ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question

ChengXiang's profile - activity

2019-03-15 09:45:58 -0500 received badge  Good Answer (source)
2019-03-15 09:45:37 -0500 received badge  Nice Question (source)
2018-11-18 21:42:40 -0500 received badge  Nice Question (source)
2015-11-26 03:26:55 -0500 received badge  Popular Question (source)
2015-09-18 18:53:14 -0500 marked best answer How to install robotnik Summit-xl stack?

Hi all. As stated in the title, I am trying to install Summit-xl from robotnik. First I downloaded the tar.gz file from its website. Then I extracted it out to my sandbox and try to rosmake it. However, rosmake have been unsuccessful,

chengxiang@ubuntu:~/fuerte_workspace/sandbox$ rosmake fuerte
[ rosmake ] rosmake starting...                                                 
[ rosmake ] Packages requested are: ['fuerte']                                  
[ rosmake ] Logging to directory /home/chengxiang/.ros/rosmake/rosmake_output- 
20121202-143919
[ rosmake ] Expanded args ['fuerte'] to:
['summit_xl_description', 'summit_xl_odometry', 'summit_xl_tf',  
'summit_xl_2dnav', 'robotnik_worlds', 'summit_xl_sbpl_nav', 'explore_stage', 
'explore', 'summit_xl_joystick', 'summit_xl_ctrl']
[rosmake-0] Starting >>> roslang [ make ]                                       
[rosmake-1] Starting >>> geometry_msgs [ make ]                                 
[rosmake-0] Finished <<< roslang  No Makefile in package roslang                
[rosmake-0] Starting >>> roscpp [ make ]                                        
[rosmake-0] Finished <<< roscpp  No Makefile in package roscpp                  
[rosmake-0] Starting >>> colladadom [ make ]                                    
[rosmake-1] Finished <<< geometry_msgs  No Makefile in package geometry_msgs    
[rosmake-1] Starting >>> sensor_msgs [ make ]                                   
[rosmake-1] Finished <<< sensor_msgs  No Makefile in package sensor_msgs        
[rosmake-1] Starting >>> summit_xl_joystick [ make ]                            
[rosmake-0] Finished <<< colladadom ROS_NOBUILD in package colladadom           
[rosmake-0] Starting >>> pr2_hardware_interface [ make ]                        
[rosmake-0] Finished <<< pr2_hardware_interface ROS_NOBUILD in package  
pr2_hardware_interface
[rosmake-0] Starting >>> urdf_interface [ make ]                                
[rosmake-0] Finished <<< urdf_interface ROS_NOBUILD in package urdf_interface   
[rosmake-0] Starting >>> urdf_parser [ make ]                                   
[rosmake-0] Finished <<< urdf_parser ROS_NOBUILD in package urdf_parser         
[rosmake-0] Starting >>> collada_parser [ make ]                                
[rosmake-0] Finished <<< collada_parser ROS_NOBUILD in package collada_parser   
[rosmake-0] Starting >>> urdf [ make ]                                          
[rosmake-0] Finished <<< urdf ROS_NOBUILD in package urdf                       
[rosmake-0] Starting >>> orocos_kdl [ make ]                                    
[rosmake-0] Finished <<< orocos_kdl ROS_NOBUILD in package orocos_kdl           
[rosmake-0] Starting >>> python_orocos_kdl [ make ]                             
[rosmake-0] Finished <<< python_orocos_kdl ROS_NOBUILD in package 
python_orocos_kdl
[rosmake-0] Starting >>> kdl [ make ]                                           
[rosmake-0] Finished <<< kdl ROS_NOBUILD in package kdl
No Makefile in package kdl
[rosmake-0] Starting >>> kdl_parser [ make ]                                    
[rosmake-0] Finished <<< kdl_parser ROS_NOBUILD in package kdl_parser           
[rosmake-0] Starting >>> rosbuild [ make ]                                      
[rosmake-0] Finished <<< rosbuild  No Makefile in package rosbuild              
[rosmake-0] Starting >>> roslib [ make ]                                        
[rosmake-0] Finished <<< roslib  No Makefile in package roslib                  
[rosmake-0] Starting >>> rosconsole [ make ]                                    
[rosmake-0] Finished <<< rosconsole  No Makefile in package rosconsole          
[rosmake-0] Starting >>> pluginlib [ make ]                                     
[rosmake-0] Finished <<< pluginlib ROS_NOBUILD in package pluginlib             
[rosmake-0] Starting >>> angles [ make ]                                        
[rosmake-0] Finished <<< angles ROS_NOBUILD in package angles                   
[rosmake-0] Starting >>> pr2_mechanism_model [ make ]                           
[rosmake-0] Finished <<< pr2_mechanism_model ROS_NOBUILD in package  
pr2_mechanism_model
[rosmake-0] Starting >>> pr2_controller_interface [ make ]                      
[rosmake-0] Finished <<< pr2_controller_interface ROS_NOBUILD in package  
pr2_controller_interface
[rosmake-0] Starting >>> bullet [ make ]                                        
[rosmake-0] Finished <<< bullet ROS_NOBUILD in package bullet                   
[rosmake-0] Starting >>> rospy [ make ]                                         
[rosmake-0] Finished <<< rospy  No Makefile in package rospy                    
[rosmake-0] Starting >>> rostest [ make ]                                       
[rosmake-0] Finished <<< rostest  No Makefile in package rostest                
[rosmake-0] Starting >>> roswtf [ make ]                                        
[rosmake-0] Finished <<< roswtf  No Makefile in package roswtf                  
[rosmake-0] Starting >>> message_filters [ make ]                               
[rosmake-0] Finished <<< message_filters  No Makefile in package message_filters
[rosmake-0] Starting >>> tf [ make ]                                            
[rosmake-0] Finished <<< tf ROS_NOBUILD in package tf                           
[rosmake-0] Starting >>> nav_msgs [ make ]                                      
[rosmake-0] Finished <<< nav_msgs  No Makefile in package nav_msgs              
[rosmake-0] Starting >>> summit_xl_ctrl [ make ]                                
[ rosmake ] All 3 linessummit_xl_joystick: 0.2 se... [ 2 Active 28/70 Complete ]
{-------------------------------------------------------------------------------
CMake Error: The source directory "/opt/ros/fuerte/stacks/summit_xl_sim  
/summit_xl_joystick" does not exist.
Specify --help for usage, or press the help button on the CMake GUI.
-------------------------------------------------------------------------------}
[ rosmake ] Output from build of package summit_xl_joystick written to:
[ rosmake ]    /home/chengxiang/.ros/rosmake/rosmake_output-20121202-143919  
/summit_xl_joystick/build_output.log
[rosmake-1] Finished <<< summit_xl_joystick [FAIL] [ 0.33 seconds ]             
[ rosmake ] Halting due to failure in package summit_xl_joystick. 
[ rosmake ] Waiting for other threads to complete.
[ rosmake ] All 3 lines
{-------------------------------------------------------------------------------
CMake Error ...
(more)
2015-06-22 00:24:59 -0500 marked best answer Using 2dnav with pr2

Hi ppl,

I have been trying to use 2dnav with pr2 robot. The tutorial I followed is this. After I reached instruction 3.1 and started Rviz,I tried to set a goal in rViz for the robot to follow, however, the robot didn't move as expected.

In Rviz, the status of all the displays are "ok". This includes the local plan, global plan and planner plan, however when I set 2D NAV GOAL, the paths are not displayed at all. So does anyone have any idea what could be the issues?

Or does anyone knows which robot works well with 2dnav? So far I tried turtlebot and pr2, both gave me some errors. I am using ubuntu 12.01 with fuerte. Thanks for your help.

1st update

After doing rostopic info move_base_simple/goal, this is what i get,

Type: geometry_msgs/PoseStamped

Publishers:
 * /rviz_ubuntu_29082_5799833781995074337 (http://ubuntu:37754/)

Subscribers:
 * /move_base_node (http://ubuntu:46201/)
2015-04-23 03:22:48 -0500 marked best answer gazebo fuerte crashes after calling gazebo/delete_model service

Hi I was following the simulator_gazebo tutorial on ROS wiki when I encountered this problem. First of all I spawned a model using " rosrun gazebo spawn_model -param coffee_cup_description -gazebo -model coffee_cup -x 0 -z 2 " and then I deleted it using " rosservice call gazebo/delete_model '{model_name: coffee_cup}' ". After I called the delete_model command,gazebo crashed unexpectedly and gave the following:

[gazebo_gui-3] process has died [pid 3162, exit code 139, cmd /opt/ros/fuerte/stacks/simulator_gazebo/gazebo/scripts/gui __name:=gazebo_gui __log:=/home/chengxiang/.ros/log/fba33798-f058-11e1-8139-0017c4794a79/gazebo_gui-3.log]. log file: /home/chengxiang/.ros/log/fba33798-f058-11e1-8139-0017c4794a79/gazebo_gui-3*.log

Other than this instance, gazebo also crashes unexpectedly sometimes when I was doing other stuffs like spawning models. Did any one of you encounter this issues before? Any advice will be appreciated. Thanks.

2014-08-14 12:49:06 -0500 received badge  Famous Question (source)
2014-08-02 11:50:53 -0500 received badge  Famous Question (source)
2014-06-16 04:32:33 -0500 received badge  Famous Question (source)
2014-06-16 04:32:33 -0500 received badge  Notable Question (source)
2014-05-29 21:28:54 -0500 received badge  Famous Question (source)
2014-04-20 06:52:18 -0500 marked best answer How do overlays work?

Hi, I recently came across a post that mentioned that we should never try to edit stuff in ros/fuerte/stacks, the correct way should be through overlay instead. This means I have been doing stuff the wrong way all along. I have been making changes to launch files in erratic_robot, which is located in stack.

I would like to know how does overlay works, the wiki page states that"The overlay now includes all packages that were installed in /opt/ros/fuerte." But it is not the case for me, my overlay (fuerte workspace) only contain a sandbox, turtlebot which i installed and some setup files.

In addition, when I installed a package (eg.erratic_robot), where should it be located? For me, the erratic_robot appears in ros/fuerte/stacks.

I appreciate your help, thank you.

2014-04-20 06:52:07 -0500 marked best answer Turtlebot RaySensor race condition

Hi. When running turtlebot i keep getting a warning message

 Warning [RaySensor.cc:206] ranges not constructed yet (zero sized)

I understand from this website that it can be solved by moving a small part of the code upward. However, when I did a "locate" on the file RaySensor.cc, all the RaySensor.cc appears to be in the trash folder

chengxiang@ubuntu:~$ locate RaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.0.1/src/physics/bullet 
/BulletRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.0.1/src/sensors/GpuRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.0.1/src/sensors/RaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.2.0.1/src/physics/bullet   
/BulletRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.2.0.1/src/sensors 
/GpuRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.2.0.1/src/sensors/RaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.3.0.1/src/physics/bullet 
/BulletRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.3.0.1/src/sensors 
/GpuRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.3.0.1/src/sensors/RaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.4.0.1/build/src/sensors  
/CMakeFiles/gazebo_sensors.dir/GpuRaySensor.cc.o
/home/chengxiang/.local/share/Trash/files/gazebo-1.4.0.1/build/src/sensors 
/CMakeFiles/gazebo_sensors.dir/RaySensor.cc.o
/home/chengxiang/.local/share/Trash/files/gazebo-1.4.0.1/src/physics/bullet  
/BulletRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.4.0.1/src/sensors 
/GpuRaySensor.cc
/home/chengxiang/.local/share/Trash/files/gazebo-1.4.0.1/src/sensors/RaySensor.cc

May i know how can i find the file or is there another way of solving this issue? I am using ROS fuerte with Ubuntu 12.04. Thank you in advance.

update 1

An error occurs when launching turtlebot after i install from source using

rosws set simulator_gazebo --svn https://code.ros.org/svn/ros-pkg/stacks
/simulator_gazebo/trunk

Error message :

[spawn_turtlebot_model-3] process has died [pid 7428, exit code 1, cmd  
/home/chengxiang/sim_workspace/simulator_gazebo/gazebo/scripts/spawn_model  
-unpause -urdf -param robot_description -model turtlebot  
__name:=spawn_turtlebot_model __log:=/home/chengxiang/.ros/log/277d87f4-1c4d- 
11e2-92d5-0017c4794a79/spawn_turtlebot_model-3.log].
log file: /home/chengxiang/.ros/log/277d87f4-1c4d-11e2-92d5-0017c4794a79  
/spawn_turtlebot_model-3*.log
2014-04-20 06:52:07 -0500 marked best answer Queries about sensors in simulation

Hi. I am a new user to ROS and have some questions regarding the use of sensors in simulation.

I undrstand that in order to simulate a sensors, you need to write the gazebo extension for it in the robot's URDF file My doubts are mainly about the elements in the gazebo's extension block.

First of all, am I right to said that the controllers are what that operate the sensors in gazebo? So do I need to install drivers for sensors at all?

To use the controller, you need to choose the correct plugins, but where do we download the plugins from? The sensor's wiki page?

Lastly, how do we know what to include in the elements within the <controller> element? So far what I did is just refer the code block from robots like turtlebot without understanding what each part is for.

I checked this website, but it is still work in process.

Thank you.Pardon me if my questions sounds amatuerish.

2014-04-20 06:51:56 -0500 marked best answer Is it possible to get navigation 1.10.1?

Hi, i am a beginner and is using the navigation stack for my school project. The function that I am interested in is the base_local_ planner. On its web page section 4 generic local planning, it is mentioned that it is possible to create custom local planner. However, this is only for release 1.10.1. But I can't get navigation 1.10.1, even after running apt-get update. (mine is 1.8.3, after checking the Cmakelist). May i know if navigation 1.10.1 is out yet? If so how can i get it?

2014-04-20 06:51:44 -0500 marked best answer Problems with gazebo plugin tutorials

Hi, I am now doing the gazebo plugin tutorial and came across some difficulties doing rosmake. My cpp file is

#include "gazebo.hh"
#include "physics/physics.h" 
#include "common/Events.hh" 
#include "common/Plugin.hh" 
#include "common/Time.hh" 
#include "common/common.h"


namespace gazebo
{
  class PluginTemplate : public Plugin
  {
    public: PluginTemplate() : Plugin() 
            {
            }

    public: void Load( sdf::ElementPtr &_sdf )
            {
            };


  };

  GZ_REGISTER_PLUGIN(PluginTemplate)

}

However, I got the following error while running rosmake

"home/chengxiang/gazebo_tutorials/src/simple_world_plugin.cpp:26:1: error: expected constructor, destructor, or type conversion before ‘}’ token"

the "}" in question here is the last "}"

Could any kind soul please enlighten me on how to solve this issue?

2014-04-20 06:51:44 -0500 marked best answer Issue with gazebo plugin tutorial

Hi guys. I have been trying to do the gazebo plugin tutorial found here. When i try to rosmake the package I created, it first indicate an error that gazebo.h is not found. I then replaced gazebo.h with gazebo.hh (i can only locate gazebo.hh in my system). That solved my issue, but it then gave me another error " error: ISO C++ forbids declaration of ‘GZ_REGISTER_PLUGIN’ with no type [-fpermissive]" during rosmake.

My cpp file is the same as what is in the tutorial. Anyone here encountered this problem before?

In addition, may I know where can I learn to write and use a gazebo plugin? Since the ROS tutorial is "work in progress".

2014-04-20 06:51:32 -0500 marked best answer Gazebo can't find rendering system

Hi everyone ! I have installed the linux OS Ubuntu 12.04 and gazebo-1.0.1 on my laptop. Although the installation of Ubuntu 12.04 is successful, I ran into some issues while running gazebo. I hope that you guys can give me some advices on how to resolve them.

I have already installed the debian package of gazebo 1.0.1 using the software centre and set the environment variables as described in the online instructions. However, when i tried to run " gzserver" in the terminal. it returned the following error

Msg Waiting for master Msg Connected to gazebo master @ http://localhost:11345 Error [RenderEngine.cc:356] Unable to load Ogre Plugin[/usr/lib/x86_64-linux-gnu/OGRE-1.7.4/Plugin_CgProgramManager.so]...Skipping

After that I added OGRE PPA, but it didn't help. I then downloaded and installed latest version of OGRE and run "gzserver" again, but it gave me another set of errors,

Exception [RenderEngine.cc:468] unable to find rendering system

Error [Rendering.cc:37] Failed to load the Rendering engine subsystem unable to find rendering system Exception [RenderEngine.cc:468] unable to find rendering system

Exception [Sensors.cc:39] Unable to load the rendering engine

terminate called after throwing an instance of 'gazebo::common::Exception' Aborted (core dumped)

Could anyone here help me with this issue? Thanks in advance.

2014-04-09 02:34:19 -0500 received badge  Famous Question (source)
2014-03-07 02:29:58 -0500 received badge  Famous Question (source)
2014-01-28 17:29:46 -0500 marked best answer Can base local planner be used for moving obstacle?

Hi guys, I have some queries regarding the base local planner in the navigation stack. I am wondering if the base local planner are able to avoid moving obstacles or is it only good for stationary obstacles?

From my simulation in Gazebo testing a robot with a moving obstacle (with a slow speed of 1m/s) , it seems that the robot is unable to do so. I configure the base_local_planner to use DWA.

Could this be a case of the robot are unable to move fast enough?

2014-01-28 17:29:42 -0500 marked best answer Rviz, slam_gmapping hangs

Hi, I am having some troubles with Rviz recently, my computer will hangs suddenly while i am using it. Originally it works fine and it is only recently that I got this problem. Does anyone have any idea what is going on? I know that my question sound really vague and lack information, but what I can deduced is my system hangs when I am using Rviz.

My graphic card is GeForce 9300M GS. Driver Version : 304.84. I am using Ubuntu 12.04. ROS fuerte. My Rviz revision number is 1.8.17.

Another thing is, this happened when I am using the 2dnav goal setting function on Rviz. And I think Rviz seems to be unable to receive message from robot footprint and obstacle. I am thinking it might have something to do with cost map or laser/odom input. Just a guess.

Any feedback will be appreciated. Thank you.

Update 1

At the point where it hangs, slam_mapping take up 12% of CPU but used up 1.2 GiB of memory.

After my system recovered from hanging, Rviz takes like 60-70 % of CPU abd used up like 100 plus MIB of memory.And I can no longer find slam_gmapping in the list of process in the system monitor. Yet it appears when I do rosnode list.

After the system recovered from hanging, I can't get any messages from move_base/local_costmap node.

In addition, I got this message on my terminal :

[ WARN] [1363349588.818795860, 121.587000000]: Could not get robot pose,  
cancelling reconfiguration
[ERROR] [1363349591.052922982, 121.887000000]: Extrapolation Error looking up 
robot pose: Unable to lookup transform, cache is empty, when looking up transform 
from frame [/base_footprint] to frame [/map]

A little background on what I am doing, I actually sort of alter the URDF so that the robot's sensors experience some pitching and rolling in motion, so I guess the input to slam_gmapping and costmap is affected. But previously such issue did not happened even after i altered the URDF.

Update 2:

Result from roswtf

Online checks summary:

Found 2 warning(s).
Warnings are things that may be just fine, but are sometimes at fault

WARNING The following node subscriptions are unconnected:
 * /move_base_node/local_costmap/voxel_grid_throttle:
   * /move_base_node/local_costmap/voxel_grid
 * /move_base_node:
   * /move_base_simple/goal
   * /move_base/cancel
 * /voxel_visualizer:
   * /move_base_node/local_costmap/voxel_grid_throttled
 * /gazebo:
   * /gazebo/set_link_state
   * /set_hfov
   * /gazebo/set_model_state
   * /set_update_rate

WARNING These nodes have died:
 * spawn_robot-5
 * slam_gmapping-11


Found 11 error(s).

ERROR Communication with [/robot_state_publisher] raised an error: 
ERROR Communication with [/slam_gmapping] raised an error: 
ERROR Communication with [/point_cloud_to_laser_manager] raised an error: 
ERROR Communication with [/voxel_visualizer] raised an error: 
ERROR Communication with [/base_laser_self_filter] raised an error: 
ERROR Communication with [/rviz_1363420915715223896] raised an error: 
ERROR Communication with [/robot_pose_ekf] raised an error: 
ERROR Could not contact the following nodes:
 * /slam_gmapping

ERROR The following nodes should be connected but aren't:
 * /robot_state_publisher->/robot_pose_ekf (/tf)
 * /robot_pose_ekf->/base_laser_self_filter (/tf)
 * /gazebo->/slam_gmapping (/base_scan/scan)
 * /gazebo->/slam_gmapping (/clock)
 * /robot_state_publisher->/base_laser_self_filter (/tf)
 * /robot_state_publisher->/slam_gmapping (/tf)
 * /slam_gmapping->/robot_pose_ekf (/tf)
 * /robot_pose_ekf->/slam_gmapping (/tf)
 * /robot_pose_ekf->/robot_pose_ekf (/tf)
 * /slam_gmapping->/base_laser_self_filter (/tf)
 * /gazebo- ...
(more)
2014-01-28 17:29:22 -0500 marked best answer Converting yaw between frames

Hi all, I have a query regarding converting yaw between frames.

The velocity commands (linear and angular) received from the base local planner are in term of robot's frame. Let says that I want to convert the velocity commands into the map's frame in gazebo, do I need to do conversion on the angular velocity?

My intuition is that since the orientation of z-axis in both robot frame and map frame are the same, the yaw in both frame should be the same right?

The reason I asked this question is because after I did an angular velocity conversion between the robot frame and world frame, the values I got are different.

1st update: The way I did the conversion is as such, rot is the double value of the original angular velocity.

(Q_is geometry_msg::quaternion , QS_ and QS_tr is geometry_msgs::QuaternionStamped )

 Q_ = tf::createQuaternionMsgFromYaw(rot_);
 QS_.header.frame_id = "base_link";
 QS_.header.stamp = ros::Time();
 QS_.quaternion = Q_;

 listener.transformQuaternion("/map", QS_, QS_tr);
 yaw = tf::getYaw(QS_tr.quaternion);
2014-01-28 17:29:20 -0500 marked best answer Problem checking out navigation 1.8.3

Hi, I was trying to checkout navigation 1.8.3 from github to my workspace. The commands I used are,

rosws set navigation --git https://github.com/ros-planning/navigation
/tree/navigation-1.8.3
rosws update

However, when doing update, I received the error:

[navigation] Fetching https://github.com/ros-planning/navigation
/tree/navigation-1.8.3 (version None) to /home/chengxiang/sim_workspace/navigation
WARNING [vcstools] Command failed: 'git clone --recursive https://github.com
/ros-planning/navigation/tree/navigation-1.8.3 /home/chengxiang/sim_workspace
/navigation'
 errcode: 128:
fatal: https://github.com/ros-planning/navigation/tree/navigation-1.8.3/info/refs 
not found: did you run git update-server-info on the server?
[/vcstools]
Exception caught during install: Error processing 'navigation' : [navigation]   
Checkout of https://github.com/ros-planning/navigation/tree/navigation-1.8.3 
version None into /home/chengxiang/sim_workspace/navigation failed.

ERROR in config: Error processing 'navigation' : [navigation] Checkout of   
https://github.com/ros-planning/navigation/tree/navigation-1.8.3 version None 
into /home/chengxiang/sim_workspace/navigation failed.

I am not familar with github at all so I don't have a clue what's wrong.Could anyone please advise? I am using ROS-fuerte on Ubuntu 12.04. Thanks in advance.

2014-01-28 17:28:32 -0500 marked best answer What is the meaning of <rayCount>, <rangeCount> and <laserCount> for laser sensor XML?

Hi, I am using simulating a laser sensor. However, I have some doubts about the meaning of some tags in the xml description. Even the ROS web page do not provide information on this.

The xml description look something like this

<gazebo reference="base_scan_link">
            <sensor:ray name="laser">
                <rayCount>683</rayCount>
                <rangeCount>683</rangeCount>
                <laserCount>1</laserCount>

                <origin>0.0 0.0 0.0</origin>
                <displayRays>false</displayRays>

                <minAngle>-135</minAngle>
                <maxAngle> 135</maxAngle>

                <minRange>0.06</minRange>
                <maxRange>4.0</maxRange>
                <resRange>0.001</resRange>
                <updateRate>10.0</updateRate>

                <controller:gazebo_ros_laser 
name="gazebo_ros_base_scan_link_controller" plugin="libgazebo_ros_laser.so">
                    <gaussianNoise>0.005</gaussianNoise>
                    <alwaysOn>true</alwaysOn>
                    <updateRate>10.0</updateRate>
                    <topicName>base_scan/scan</topicName>
                    <frameName>base_scan_link</frameName>
                    <interface:laser name="gazebo_ros_base_scan_link_iface"/>
                </controller:gazebo_ros_laser>
            </sensor:ray>
        </gazebo>

I wish to know what are the function of <raycount>, <rangecount>,<lasercount> and Gaussian noise. Can anyone explain what are the meanings of the above mentioned tags? Thank you.

2014-01-28 17:28:24 -0500 marked best answer Odometry in erratic simulation

Hi people. I am actually running a simulation of erratic robot on gazebo when this particular question strike me. The launch file I used is "erratic_navigation_apps demo_2dnav_slam.launch ".

For my project's purpose, I am trying to change the sources of odometry. When I do a rostopic check and tf_viewframe , I realised that the gazebo is producing the odometry information( the transformation from odom to base_footprint).

But when I run through all the launch files, I can't find which section is responsible for generating the transformation. Or is it that, in a Gazebo simulation, the odometry of the robot will be generated automatically?

In short, may I know which node in "erratic_navigation_apps demo_2dnav_slam.launch" is producing the odometry information? Thank you for your time.

2014-01-28 17:28:23 -0500 marked best answer Doubts regarding gmapping

Hi. I have some doubts regarding gmapping. On the wiki page, it is stated that gmapping make use of both laserscan and odometry data to build a map. However,it seems that the slam_mapping node only subscribe to “scan” topic but not to “odom” topic. So, is it that we only need to set the “odom_frame” parameter when launching gmapping to “odom” so that the gmapping receive odometry data? Thank you.