Gazebo | Ignition | Community
Ask Your Question

crazymumu's profile - activity

2017-05-27 02:25:17 -0500 received badge  Necromancer (source)
2017-05-27 02:25:17 -0500 received badge  Teacher (source)
2015-11-02 00:10:35 -0500 received badge  Famous Question (source)
2015-09-17 09:32:22 -0500 received badge  Taxonomist
2015-08-11 22:07:17 -0500 received badge  Notable Question (source)
2015-03-16 02:26:17 -0500 received badge  Popular Question (source)
2015-03-04 16:16:21 -0500 commented answer rostopic send msgs to robot in ros control of gazebo didn't work

thanks for your help

2015-03-03 17:34:39 -0500 asked a question 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

2015-02-27 19:58:15 -0500 received badge  Editor (source)
2015-02-27 19:57:32 -0500 answered a question Unable to convert from SDF version 1.5 to 1.4

1:$ gazebo;

2:$ cd ~/.gazebo/models/Yourworldname

3:$ gedit model.config
Add this line : <sdf version="1.4">model.sdf</sdf>

4: $ gedit model.sdf
Change to this line :<sdf version="1.4">