Robotics StackExchange | Archived questions

rostopic send msgs to robot in ros control of gazebo didn't work

lin@lin-VirtualBox:~$ rostopic list
/clock
/gazebo/linkstates
/gazebo/model
states
/gazebo/parameterdescriptions
/gazebo/parameter
updates
/gazebo/setlinkstate
/gazebo/setmodelstate
/myrobot/jointstates
/myrobot/leftWheel
effortcontroller/command
/myrobot/rightWheel
effortcontroller/command
/rosout
/rosout
agg
/tf
lin@lin-VirtualBox:~$ rostopic pub -1 /myrobot/leftWheeleffortcontroller/command std_msgs/Float64 "data: 1.5"
publishing and latching message for 3.0 seconds
lin@lin-VirtualBox:~$

I am using ros_contol to control my robot move. I roslaunch the file, no error. but send command with the topic i have, but the robot didn't move.
thanks for help, all.

INFO:
process[myrobot/controllerspawner-1]: started with pid [6845]
process[robot
statepublisher-2]: started with pid [6846]
/opt/ros/indigo/lib/robot
statepublisher/robotstatepublisher
[INFO] [WallTime: 1425424374.533474] [0.000000] Controller Spawner: Waiting for service controller
manager/loadcontroller
[INFO] [WallTime: 1425424374.534971] [0.000000] Controller Spawner: Waiting for service controller
manager/switchcontroller
[INFO] [WallTime: 1425424374.537735] [0.000000] Controller Spawner: Waiting for service controller
manager/unloadcontroller
[INFO] [WallTime: 1425424374.541571] [0.000000] Loading controller: joint
statecontroller
[INFO] [WallTime: 1425424374.696059] [54.878000] Loading controller: rightWheel
effortcontroller
[INFO] [WallTime: 1425424374.970727] [55.118000] Loading controller: leftWheel
effortcontroller
[INFO] [WallTime: 1425424374.987635] [55.132000] Controller Spawner: Loaded controllers: joint
statecontroller, rightWheeleffortcontroller, leftWheeleffortcontroller
[INFO] [WallTime: 1425424374.992025] [55.137000] Started controllers: joint
statecontroller, rightWheeleffortcontroller, leftWheeleffort_controller

Asked by crazymumu on 2015-03-03 18:34:39 UTC

Comments

Answers

Any ros_contol question is probably best answered directly from the upstream issue tracker at:

https://github.com/ros-simulation/gazebo\_ros\_pkgs

Asked by Jose Luis Rivero on 2015-03-04 12:23:36 UTC

Comments

thanks for your help

Asked by crazymumu on 2015-03-04 17:16:21 UTC