Gazebo | Ignition | Community
Ask Your Question

rohin's profile - activity

2016-10-21 09:45:13 -0500 received badge  Famous Question (source)
2016-09-28 04:02:35 -0500 received badge  Notable Question (source)
2016-09-28 04:02:35 -0500 received badge  Popular Question (source)
2016-06-07 09:47:59 -0500 asked a question STRANGE ERROR! Unable to move Revolute Joints in Gazebo

I'm running : 1. ROS Indigo 2. Ubuntu 14.04 Trusty

I'm simulating a 6DOF robotic arm using ros_control and using gazebo_ros_control plugins. I'm using Joint Position Controllers.

I have set up the .yaml file containing the type of controllers. I have also added all the transmission and gazebo_ros_control tags in my URDF file.

Everything launches without any error. When I try to publish messages on

/nymble_arm/joint2_position_controller/command std_msgs/Float64 1.0

This is my rostopic list.

/clock
/gazebo/link_states
/gazebo/model_states
/gazebo/parameter_descriptions
/gazebo/parameter_updates
/gazebo/set_link_state
/gazebo/set_model_state
/nymble_arm/joint1_position_controller/command
/nymble_arm/joint2_position_controller/command
/nymble_arm/joint3_position_controller/command
/nymble_arm/joint4_position_controller/command
/nymble_arm/joint5_position_controller/command
/nymble_arm/joint6_position_controller/command
/nymble_arm/joint_states
/rosout
/rosout_agg
/tf
/tf_static

I'm unable to move the revolute joints. Interestingly I have two continuous joints among my 6DOF which move.

When I publish a message on revolute joints nothing happens.

rohin@dreamworks:~$ rostopic pub /nymble_arm/joint2_position_controller/command std_msgs/Float64 1.0
publishing and latching message. Press ctrl-C to terminate

Also these movements are abrupt and not in a smooth manner. Whereas I've tried tutorials where the arm follows a smoother motion using Joint Position Controllers.

How should I get my revolute joints to move? Please help!

edit