Robotics StackExchange | Archived questions

Help with getting the robot to move in gazebo

Hello,

I cant get the robot to move in gazebo.

trying to run:

    roslaunch robotican_lizi lizi.launch gazebo:=true

    rostopic pub /cmd_vel geometry_msgs/Twist -r 10 -- '[0.2, 0.0, 0.0]' '[0.0, 0.0, 0.6]'

The world and the robot model are loaded, and I can see that my command is successfully published to the cmd_vel topic.

When I select View->Wire-frame I can see that nothing is moving.

It’s happening on all robots that I’m trying to launch (lizi, komodo, armadillo)

I'm running ROS Indigo on ubuntu14.04, gazebo 2.

Robotican - http://wiki.ros.org/robotican

What am I missing?

Thanks!

Asked by AssafZI on 2017-11-23 07:54:51 UTC

Comments

Answers

To debug the problem, I will probably start with:

  1. Check that the gazebo simulator is not paused. Sometimes happen.
  2. Check that the /cmd_vel topic is the one really in use by the gazebo plugin or the code that controls the motion of the robot. Sometimes the launch remmaping make it to use namespaces (i.e: /robot/cmd_vel).
  3. Check that the code that handles the motion is being called. You can use the help of the ROS log system or any other programming mechanism.

Asked by Jose Luis Rivero on 2017-11-23 15:41:14 UTC

Comments

It was mobile_base_controller/cmd_vel Thanks!

Asked by AssafZI on 2017-11-23 22:41:39 UTC

no problem, please mark the answer as right so it does not appear as unanswered.

Asked by Jose Luis Rivero on 2017-11-29 06:00:43 UTC