Safdar,<div><br></div><div>Its possible that with the rates you posted for your transform and your setting of the transform_tolerance parameter on the costmap, that things are timing out. Can you post a couple of examples of the full "Costmap2dROS transform timeout" error along with the configuration files that you're using to bring up the navigation stack. Those two things should help track this down.</div>
<div><br></div><div>Hope all is well,</div><div><br></div><div>Eitan<br><br><div class="gmail_quote">On Tue, Aug 31, 2010 at 8:09 AM, safdar_zaman <span dir="ltr"><<a href="mailto:safdaraslam@yahoo.com">safdaraslam@yahoo.com</a>></span> wrote:<br>
<blockquote class="gmail_quote" style="margin:0 0 0 .8ex;border-left:1px #ccc solid;padding-left:1ex;"><br>
Hi Enea Scioni,<br>
Thanks for so detailed answer: I followed your instruction and just<br>
experimented again, following are the findings:<br>
RosAria:<br>
First RosAria is a node which enables us to move Real Robot (poineer P3DX),<br>
It subscribes a topic /cmd_vel with geometry_msgs/Twist message.<br>
some code from RosAria:<br>
{<br>
  pos = robot->getPose();<br>
  tf::poseTFToMsg(tf::Pose(tf::Quaternion(pos.getTh()*M_PI/180, 0, 0),<br>
tf::Vector3(pos.getX(), pos.getY(), 0)),<br>
  position.pose.pose);<br>
  position.twist.twist.linear.x = robot->getVel();<br>
  position.twist.twist.angular.z = robot->getRotVel()*M_PI/180;<br>
  position.header.frame_id = "odom";<br>
  position.header.stamp = ros::Time::now();<br>
  pose_pub.publish(position);<br>
  ROS_INFO("rcv: %f %f %f p.x: %f p.y: %f", position.header.stamp.toSec(),<br>
(double) position.twist.twist.linear.x,<br>
  (double)   position.twist.twist.angular.z, (double) pos.getX(), (double)<br>
pos.getY());<br>
  ros::Duration(1e-3).sleep();<br>
    tf::Quaternion laserQ;<br>
    laserQ.setRPY(0.0, 0.0, pos.getTh());<br>
    tf::Transform txLaser =  tf::Transform(laserQ,tf::Point(0.05, 0.0,<br>
0.15));<br>
    tf.sendTransform(tf::StampedTransform(txLaser, ros::Time::now(),<br>
"base_link", "laser"));//"base_laser_link"));<br>
    tf::Transform txIdentity(tf::createIdentityQuaternion(),<br>
                             tf::Point(0.0, 0.0, 0.0));<br>
    tf.sendTransform(tf::StampedTransform(txIdentity,<br>
                                          ros::Time::now(),<br>
                                          "base_footprint",<br>
                                          "base_link"));<br>
    tf::Quaternion odomQ;<br>
     tf::quaternionMsgToTF(position.pose.pose.orientation, odomQ);<br>
    tf::Transform txOdom(odomQ, tf::Point((double) pos.getX()/1000.0,<br>
(double) pos.getY()/1000.0, pos.getTh()/*0.0*/));<br>
    tf.sendTransform(tf::StampedTransform(txOdom, ros::Time::now() ,"odom",<br>
"base_footprint"));<br>
   clockMsg.clock = ros::Time::now();<br>
   clock_pub.publish(clockMsg);<br>
}<br>
I run this node using [$rosrun ROSARIA RosAria _port:=/dev/ttyUSB0] then<br>
this node starts and subscribes the topic /cmd_vel. Then I run my own made<br>
node [$rosrun ROSARIA rob_key] which publishes geometry_msgs/Twist taking<br>
commands by arrow keys of keyboard.<br>
<br>
Frames:<br>
I checked frames by [$rosrun tf view_frames],  the frame's sequence is<br>
correct and quite according to how you said, i.e.<br>
with names and sequence : /map->/odom->/base_footprint->base_link->/laser<br>
shown in frames.pdf.<br>
map->odom : Broadcaster: /amcl , Average rate: 4.890 Hz, Most recent<br>
transform: 0.155 sec old, Buffer length: 4.908 sec<br>
odom->base_footprnt:Broadcaster:/RosAria,Average rate:10.204 Hz,Most recent<br>
transform: 0.063 sec old,Buffer length: 4.900 sec<br>
base_footprnt->base_link:same as above for odom->base_footprint<br>
base_link->laser:same as above for base_footprint-> base_link<br>
<br>
Sequence of the nodes I run:<br>
1.$roscore<br>
2.$rosrun ROSARIA RosAria _port:=/dev/ttyUSB0<br>
3.$rosrun sicktoolbox_wrapper sicklms _port:=/dev/ttyUSB1 _baud:=38400<br>
get message DataStream Received.<br>
4.$roslaunch amcl_diff.launch  from amcl/axamples> directory.<br>
get message<br>
[ WARN] [1283264052.917100260]: Request for map failed; trying again...<br>
[ WARN] [1283264053.418347837]: Request for map failed; trying again...<br>
[ WARN] [1283264053.926562217]: Request for map failed; trying again...<br>
[ INFO] [1283264054.545362657]: Received a 4000 X 4000 map @ 0.050 m/pix<br>
<br>
[ INFO] [1283264054.757590054]: map returned<br>
[ INFO] [1283264054.766719775]: Initializing likelihood field model; this<br>
can take some time on large maps...<br>
[ INFO] [1283264055.174108077]: Done initializing likelihood field model.<br>
[ WARN] [1283264055.247433315]: Message from [/sicklms] has a<br>
non-fully-qualified frame_id [laser]. Resolved locally to [/laser].  This is<br>
will likely not work in multi-robot systems.  This message will only print<br>
once.<br>
[ WARN] [1283264093.896718060]: Failed to transform initial pose in time<br>
(You requested a transform that is 0.065 miliseconds in the past,<br>
but the most recent transform in the tf buffer is 95.781 miliseconds old.<br>
<div class="im"> When trying to transform between /map and /base_link.<br>
)<br>
</div>[ INFO] [1283264093.896820238]: Setting pose (1283264093.896801): 0.011<br>
-0.010 0.000<br>
<br>
5.$rosrun map_server map_server map.yaml<br>
get message:<br>
[ INFO] [1283264053.796235254]: Loading map from image "./map.pgm"<br>
[ INFO] [1283264054.084837439]: Read a 4000 X 4000 map @ 0.050 m/cell<br>
[ INFO] [1283264054.449655659]: Sending map<br>
<br>
6.$rosrun rviz rviz<br>
get message:<br>
[ INFO] [1283264081.753891609]: Loading general config from<br>
[/home/safdar/.rviz/config]<br>
[ INFO] [1283264081.754240117]: Loading display config from<br>
[/home/safdar/.rviz/display_config]<br>
[ INFO] [1283264093.894115354]: Setting pose: 0.011 -0.010 0.000<br>
[frame=/map]<br>
<br>
AND<br>
map.yaml contains:<br>
[image: map.pgm<br>
<div class="im">resolution: 0.050000<br>
origin: [-100.000000, -100.000000, 0.000000]<br>
</div>#origin: [0.000000, 0.000000, 0.000000]<br>
<div class="im">negate: 0<br>
occupied_thresh: 0.65<br>
</div>free_thresh: 0.196]<br>
<br>
THEN I MOVE ROBOT:<br>
Moving Robot almost 1 meter in forward direction:<br>
Starting till ending 1 meter motion of Robot ,I saved data from topics<br>
/odom, /scan, /amcl_pose and /particlecloud as given below:<br>
<br>
=====================================<br>
TOPIC /amcl_pose:<br>
---<br>
header:<br>
  seq: 2<br>
  stamp:<br>
    secs: 1283264215<br>
    nsecs: 511374608<br>
  frame_id: map<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 0.247589351646<br>
      y: -0.014679411528<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.00336333731185<br>
      w: 0.999994343965<br>
  covariance: [0.29763234232004948, 0.0025907719733360285, 0.0, 0.0, 0.0,<br>
0.0, 0.0025907719733360285, 0.24746057733576973, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.083540103401309157, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 3<br>
  stamp:<br>
    secs: 1283264216<br>
    nsecs: 151775071<br>
  frame_id: map<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 0.497609492943<br>
      y: 0.0093983678752<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.00909101066835<br>
      w: 0.999958675909<br>
  covariance: [0.33799146489379533, 0.010049943074077266, 0.0, 0.0, 0.0,<br>
0.0, 0.010049943074077266, 0.27290467320518264, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.086906835608134989, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 4<br>
  stamp:<br>
    secs: 1283264216<br>
    nsecs: 579240571<br>
  frame_id: map<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 0.675671959326<br>
      y: 0.0277861157726<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.012026257738<br>
      w: 0.999927681947<br>
  covariance: [0.36283060340373735, 0.014118143333576845, 0.0, 0.0, 0.0,<br>
0.0, 0.014118143333576845, 0.30805645206476079, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.099034657680711305, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 5<br>
  stamp:<br>
    secs: 1283264217<br>
    nsecs: 219611415<br>
  frame_id: map<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 0.843883973475<br>
      y: 0.047129095818<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.0122639546581<br>
      w: 0.99992479488<br>
  covariance: [0.39540569106077028, 0.0092167690246466108, 0.0, 0.0, 0.0,<br>
0.0, 0.0092167690246466108, 0.36344868131336877, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.11715264662452711, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
=========================<br>
TOPIC /odom:<br>
header:<br>
  seq: 1945<br>
  stamp:<br>
    secs: 1283264186<br>
    nsecs: 134936757<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 1946<br>
  stamp:<br>
    secs: 1283264186<br>
    nsecs: 234943671<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 1947<br>
  stamp:<br>
    secs: 1283264186<br>
    nsecs: 334954766<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
   .<br>
   .<br>
   .<br>
header:<br>
  seq: 2365<br>
  stamp:<br>
    secs: 1283264228<br>
    nsecs: 150935090<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 1151.0<br>
      y: -1.0<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -4.96052408606e-16<br>
      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 2366<br>
  stamp:<br>
    secs: 1283264228<br>
    nsecs: 250972872<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 1151.0<br>
      y: -1.0<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -4.96052408606e-16<br>
      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 2367<br>
  stamp:<br>
    secs: 1283264228<br>
    nsecs: 350933752<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 1151.0<br>
      y: -1.0<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -4.96052408606e-16<br>
      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 2368<br>
  stamp:<br>
    secs: 1283264228<br>
    nsecs: 452759196<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 1151.0<br>
      y: -1.0<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -4.96052408606e-16<br>
      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
---<br>
header:<br>
  seq: 2369<br>
  stamp:<br>
    secs: 1283264228<br>
    nsecs: 551957980<br>
  frame_id: odom<br>
child_frame_id: ''<br>
pose:<br>
  pose:<br>
    position:<br>
      x: 1151.0<br>
      y: -1.0<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -4.96052408606e-16<br>
      w: 1.0<br>
  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
twist:<br>
  twist:<br>
    linear:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>    angular:<br>
<div class="im">      x: 0.0<br>
      y: 0.0<br>
      z: 0.0<br>
</div>  covariance: [0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0,<br>
0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0, 0.0]<br>
<br>
===============================<br>
TOPIC /particleclouds<br>
header:<br>
  seq: 2<br>
  stamp:<br>
    secs: 1283264215<br>
    nsecs: 756479577<br>
  frame_id: map<br>
poses:<br>
  -<br>
    position:<br>
      x: 0.276259489987<br>
      y: 0.59703817945<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.149056594966<br>
      w: 0.988828666401<br>
  -<br>
    position:<br>
      x: 0.740718253068<br>
      y: -0.089673382954<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.136820644404<br>
      w: 0.990595836487<br>
  -<br>
    position:<br>
      x: -0.235402031999<br>
      y: -0.640814719739<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.0373773127287<br>
      w: 0.999301224103<br>
  -<br>
    position:<br>
      x: 0.195227750385<br>
      y: -0.533825584407<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.253166567161<br>
      w: 0.967422704546<br>
  -<br>
    position:<br>
      x: 1.06535852562<br>
      y: -0.111224649481<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.134672195018<br>
      w: 0.990890205769<br>
  -<br>
    position:<br>
      x: 0.509493294264<br>
      y: 0.382609565205<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.200947384627<br>
      w: 0.979602035835<br>
  -<br>
    position:<br>
      x: 0.106648801578<br>
      y: -0.0610606053734<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.261785029675<br>
      w: 0.965126208451<br>
  -<br>
    position:<br>
      x: 0.738234944648<br>
      y: 0.278477991024<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.0384439240972<br>
      w: 0.999260759111<br>
  -<br>
    position:<br>
      x: -0.297492221037<br>
      y: 0.558259590591<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.30049924452<br>
      w: 0.953782052695<br>
  -<br>
    position:<br>
      x: 0.0593276507712<br>
      y: 0.492263601603<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.181497946659<br>
      w: 0.983391323614<br>
  -<br>
    position:<br>
      x: 0.532087494476<br>
      y: 0.0744991931483<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.0384564241622<br>
      w: 0.999260278126<br>
  -<br>
    position:<br>
      x: 0.143513019496<br>
      y: -0.954441759189<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.182208088273<br>
      w: 0.983259992356<br>
  -<br>
    position:<br>
      x: 0.203350320118<br>
      y: 0.357348693277<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.131358876168<br>
      w: 0.99133488068<br>
  -<br>
    position:<br>
      x: -0.248090219989<br>
      y: 0.0224983919907<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.0394652395713<br>
      w: 0.999220943969<br>
  -<br>
    position:<br>
      x: 0.961917733019<br>
      y: 0.617788587923<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.150467678296<br>
      w: 0.988614928973<br>
      .<br>
      .<br>
      .<br>
    position:<br>
      x: 0.386256567908<br>
      y: -0.578717321836<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.026541595927<br>
      w: 0.999647709789<br>
  -<br>
    position:<br>
      x: 0.261445201574<br>
      y: 0.933399436686<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.29194663018<br>
      w: 0.956434611004<br>
  -<br>
    position:<br>
      x: 1.10912564935<br>
      y: 0.88026309372<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.231161506464<br>
      w: 0.972915390941<br>
  -<br>
    position:<br>
      x: 0.436744885215<br>
      y: -0.129462255606<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.0893570920922<br>
      w: 0.995999653661<br>
  -<br>
    position:<br>
      x: 2.40085931845<br>
      y: 0.0586482542803<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.153628940656<br>
      w: 0.988128609338<br>
  -<br>
    position:<br>
      x: 0.552989709579<br>
      y: -0.824151892873<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.229310627028<br>
      w: 0.973353294715<br>
  -<br>
    position:<br>
      x: 0.595353605949<br>
      y: 0.225873002097<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: 0.179521736015<br>
      w: 0.983754007005<br>
  -<br>
    position:<br>
      x: -0.335761130772<br>
      y: -0.438287725821<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.223219289279<br>
      w: 0.974768253942<br>
  -<br>
    position:<br>
      x: 1.5799615211<br>
      y: -0.0490837249542<br>
<div class="im">      z: 0.0<br>
    orientation:<br>
      x: 0.0<br>
      y: 0.0<br>
</div>      z: -0.200542106019<br>
      w: 0.97968508395<br>
==================<br>
TOPIC /scan<br>
---<br>
header:<br>
  seq: 859<br>
  stamp:<br>
    secs: 1283264192<br>
    nsecs: 891810522<br>
  frame_id: laser<br>
angle_min: -1.57079637051<br>
angle_max: 1.57079637051<br>
angle_increment: 0.00872664619237<br>
time_increment: 7.40740724723e-05<br>
scan_time: 0.0266666673124<br>
range_min: 0.0<br>
range_max: 8.10000038147<br>
ranges: [5.3940000534057617, 5.4010000228881836, 5.4110002517700195,<br>
5.4130001068115234, 5.4150004386901855, 5.4150004386901855,<br>
5.5810003280639648, 6.0370001792907715, 7.9800004959106445,<br>
7.7320003509521484, 6.1870002746582031, 6.1580004692077637,<br>
6.1830000877380371, 7.8010005950927734, 7.8070001602172852,<br>
7.820000171661377, 7.8320002555847168, 7.9100003242492676,<br>
7.6790003776550293, 7.5970005989074707, 7.3090004920959473,<br>
7.0900001525878906, 7.1090002059936523, 7.1180005073547363,<br>
7.13800048828125, 7.1570005416870117, 7.1760001182556152, 4.264000415802002,<br>
4.2770004272460938, 4.75, 8.2639999389648438, 32.76300048828125,<br>
32.76300048828125, 4.0260000228881836, 5.7460002899169922,<br>
7.764000415802002, 4.6400003433227539, 5.0400004386901855,<br>
3.9720001220703125, 4.2760000228881836, 4.2410001754760742,<br>
4.1750001907348633, 4.139000415802002, 4.1110000610351562,<br>
3.8270001411437988, 3.944000244140625, 4.0610003471374512,<br>
3.8340001106262207, 3.6180002689361572, 4.0470004081726074,<br>
.<br>
.<br>
.<br>
.<br>
.<br>
header:<br>
  seq: 1061<br>
  stamp:<br>
    secs: 1283264236<br>
    nsecs: 965322<br>
  frame_id: laser<br>
angle_min: -1.57079637051<br>
angle_max: 1.57079637051<br>
angle_increment: 0.00872664619237<br>
time_increment: 7.40740724723e-05<br>
scan_time: 0.0266666673124<br>
range_min: 0.0<br>
range_max: 8.10000038147<br>
ranges: [4.5940003395080566, 4.5980000495910645, 3.7400002479553223,<br>
3.7380001544952393, 3.7190001010894775, 4.0370001792907715,<br>
3.4580001831054688, 3.567000150680542, 3.2970001697540283,<br>
3.3000001907348633, 3.3880002498626709, 3.1510002613067627,<br>
2.9940001964569092, 3.1760001182556152, 3.7020001411437988,<br>
3.694000244140625, 3.0930001735687256, 2.8700001239776611,<br>
3.2510001659393311, 3.5540001392364502, 3.4530000686645508,<br>
3.2610001564025879, 2.944000244140625, 2.812000036239624,<br>
2.6570000648498535, 2.6560001373291016, 2.9130001068115234,<br>
3.569000244140625, 3.1160001754760742, 3.1190001964569092,<br>
3.5170001983642578, 8.5329999923706055, 8.5580005645751953,<br>
3.3710000514984131, 3.3940000534057617, 8.6350002288818359,<br>
3.1750001907348633, 3.0980000495910645, 3.1060001850128174,<br>
8.8610000610351562, 8.8900003433227539, 8.9200000762939453,<br>
8.9590005874633789, 8.9880008697509766, 9.0200004577636719,<br>
9.0580005645751953, 9.0989999771118164, 9.1400003433227539,<br>
9.0700006484985352, 9.1160001754760742, 9.1530008316040039,<br>
9.2000007629394531, 9.2370004653930664, 9.2920007705688477,<br>
9.3360004425048828, 9.3819999694824219, 9.4270000457763672,<br>
8.0729999542236328, 7.9720005989074707, 7.8580002784729004,<br>
7.758000373840332, 7.6540002822875977, 32.767002105712891,<br>
32.76300048828125, 32.76300048828125, 32.76300048828125, 7.0290002822875977,<br>
7.0770001411437988, 6.9890003204345703, 6.9090003967285156,<br>
6.8310003280639648, 6.7570004463195801, 6.6820001602172852,<br>
6.6010003089904785, 6.5210003852844238, 5.6670002937316895,<br>
5.629000186920166, 3.7200002670288086, 3.6830000877380371,<br>
3.6550002098083496, 3.6260001659393311, 3.5970001220703125,<br>
3.6040000915527344, 3.570000171661377, 3.5400002002716064,<br>
3.5130002498626709, 3.4760000705718994, 3.4490001201629639,<br>
3.4230000972747803, 3.3880002498626709, 3.3670001029968262,<br>
3.3310000896453857, 3.315000057220459, 3.2970001697540283,<br>
3.2670001983642578, 3.2460000514984131, 3.2200002670288086,<br>
3.2000000476837158, 3.1810002326965332, 3.1620001792907715,<br>
3.1360001564025879, 3.1120002269744873, 3.0990002155303955,<br>
3.0260002613067627, 3.0230002403259277, 2.9980001449584961,<br>
2.9810001850128174, 2.9600000381469727, 2.9880001544952393,<br>
2.9690001010894775, 2.9470000267028809, 2.9350001811981201,<br>
2.9210002422332764, 2.9010000228881836, 2.8910000324249268,<br>
2.8730001449584961, 2.8670001029968262, 2.8490002155303955,<br>
2.8340001106262207, 2.8010001182556152, 2.7010002136230469,<br>
2.7920000553131104, 2.7820000648498535, 2.7650001049041748,<br>
2.4220001697540283, 1.7670000791549683, 1.7690000534057617,<br>
1.8730001449584961, 2.2690000534057617, 2.255000114440918,<br>
2.2880001068115234, 2.2760000228881836, 2.2740001678466797,<br>
2.2800002098083496, 2.2950000762939453, 2.3289999961853027,<br>
2.4840002059936523, 2.4740002155303955, 2.4740002155303955,<br>
2.4610002040863037, 2.442000150680542, 2.4330000877380371,<br>
2.4230000972747803, 2.4230000972747803, 2.4140000343322754,<br>
2.4040000438690186, 2.062000036239624, 2.0530002117156982,<br>
2.0460000038146973, 2.0370001792907715, 2.0360000133514404,<br>
2.0190000534057617, 1.6360000371932983, 1.6550000905990601,<br>
1.9040000438690186, 2.0150001049041748, 2.0150001049041748,<br>
2.0170001983642578, 2.0170001983642578, 2.0170001983642578,<br>
2.0180001258850098, 2.0190000534057617, 2.0220000743865967, 2.125,<br>
2.3340001106262207, 2.3380000591278076, 2.3390002250671387,<br>
2.3390002250671387, 2.3300001621246338, 2.3310000896453857,<br>
2.3310000896453857, 2.3320000171661377, 2.3320000171661377,<br>
2.3320000171661377, 2.3320000171661377, 2.3320000171661377,<br>
2.3300001621246338, 2.2870001792907715, 2.2760000228881836,<br>
2.2710001468658447, 2.2510001659393311, 2.0610001087188721,<br>
2.128000020980835, 2.2840001583099365, 1.9290001392364502,<br>
1.9240001440048218, 1.9050000905990601, 1.9030001163482666,<br>
1.91100013256073, 1.91100013256073, 1.9190001487731934, 1.9180001020431519,<br>
1.9190001487731934, 1.9180001020431519, 1.9260001182556152,<br>
1.9260001182556152, 1.9350000619888306, 1.9350000619888306,<br>
1.9350000619888306, 1.9350000619888306, 1.942000150680542,<br>
1.9410001039505005, 1.9510000944137573, 1.9520001411437988,<br>
1.9610000848770142, 1.970000147819519, 1.970000147819519,<br>
1.9790000915527344, 1.9790000915527344, 1.9780000448226929,<br>
1.9880000352859497, 1.9950001239776611, 2.004000186920166,<br>
2.005000114440918, 2.0140001773834229, 2.0230000019073486,<br>
2.0310001373291016, 2.0310001373291016, 2.0390000343322754,<br>
2.0470001697540283, 2.1840000152587891, 2.5300002098083496,<br>
2.5400002002716064, 2.5480000972747803, 2.5580000877380371,<br>
2.567000150680542, 2.5770001411437988, 2.5840001106262207,<br>
2.6040000915527344, 2.6030001640319824, 2.6220002174377441,<br>
2.632000207901001, 2.6400001049041748, 2.6500000953674316,<br>
2.6680002212524414, 2.6780002117156982, 2.630000114440918,<br>
2.5890002250671387, 2.562000036239624, 2.5250000953674316,<br>
2.4870002269744873, 2.4500000476837158, 2.4240000247955322,<br>
2.3960001468658447, 2.3580000400543213, 2.3370001316070557,<br>
2.3500001430511475, 2.5960001945495605, 2.6060001850128174,<br>
2.5900001525878906, 2.6010000705718994, 2.627000093460083,<br>
2.6350002288818359, 2.6390001773834229, 2.6550002098083496,<br>
2.6720001697540283, 2.6850001811981201, 2.7030000686645508,<br>
2.7200000286102295, 2.7370002269744873, 2.7460000514984131,<br>
2.8300001621246338, 2.8270001411437988, 2.8020000457763672,<br>
2.7840001583099365, 2.7410001754760742, 2.753000020980835,<br>
2.7140002250671387, 2.7310001850128174, 2.7590000629425049,<br>
2.7850000858306885, 2.8030002117156982, 2.8370001316070557,<br>
2.8630001544952393, 2.8880002498626709, 2.9140000343322754,<br>
2.9480001926422119, 2.9760000705718994, 3.0130002498626709,<br>
1.9100000858306885, 1.9040000438690186, 2.0280001163482666,<br>
3.1670000553131104, 3.9000000953674316, 3.8720002174377441,<br>
3.8550002574920654, 2.0230000019073486, 2.0450000762939453,<br>
2.0559999942779541, 2.062000036239624, 2.0410001277923584,<br>
2.0350000858306885, 1.0120000839233398, 0.99700003862380981,<br>
0.98600006103515625, 0.99400001764297485, 1.0120000839233398,<br>
3.8570001125335693, 3.9100000858306885, 0.99700003862380981,<br>
4.0320000648498535, 4.1070003509521484, 4.1720004081726074,<br>
5.4050002098083496, 5.3780002593994141, 5.4800004959106445,<br>
5.5710000991821289, 5.6830000877380371, 5.6350002288818359,<br>
5.6160001754760742, 5.5890002250671387, 5.5710000991821289,<br>
5.5530004501342773, 5.5340003967285156, 5.5270004272460938,<br>
5.499000072479248, 5.5110001564025879, 5.6480002403259277,<br>
5.8010001182556152, 5.948000431060791, 6.1160001754760742,<br>
6.444000244140625, 6.6750001907348633, 6.883000373840332, 7.008000373840332,<br>
7.0220003128051758, 7.0030002593994141, 6.9860005378723145,<br>
6.9670004844665527, 6.5100002288818359, 6.9220004081726074,<br>
6.8930001258850098, 6.8950004577636719, 6.8860001564025879,<br>
6.8590002059936523, 6.6260004043579102, 6.6170001029968262,<br>
6.6080002784729004, 6.6080002784729004, 6.5970001220703125,<br>
6.5890002250671387, 6.5720005035400391, 6.5630002021789551,<br>
6.8060002326965332, 6.8060002326965332, 6.7960004806518555,<br>
6.7860002517700195, 6.3570003509521484, 6.7680001258850098,<br>
6.7660002708435059, 6.7560005187988281, 6.754000186920166,<br>
4.8280000686645508, 4.7670001983642578, 4.9860000610351562,<br>
4.754000186920166, 32.76300048828125, 4.8530001640319824,<br>
5.4320001602172852, 6.7350001335144043, 6.7470002174377441]<br>
intensities: []<br>
<br>
<br>
Do you see anything problematic for localization?<br>
Because I think localization is problematic that's why next step move_base<br>
for path_planning does not work.<br>
I am sorry that you had to read such a long message.<br>
Please any idea?<br>
<br>
with best regards,<br>
safdar<br>
<font color="#888888"><br>
--<br>
View this message in context: <a href="http://ros-users.122217.n3.nabble.com/sensor-origin-tp1388170p1394818.html" target="_blank">http://ros-users.122217.n3.nabble.com/sensor-origin-tp1388170p1394818.html</a><br>
</font><div><div></div><div class="h5">Sent from the ROS-Users mailing list archive at Nabble.com.<br>
_______________________________________________<br>
ros-users mailing list<br>
<a href="mailto:ros-users@code.ros.org">ros-users@code.ros.org</a><br>
<a href="https://code.ros.org/mailman/listinfo/ros-users" target="_blank">https://code.ros.org/mailman/listinfo/ros-users</a><br>
</div></div></blockquote></div><br></div>