moving sr_hand ros fuerte with code
I tried to move de hand with rostopic and this work very well
rostopic pub /sh_ffj3_mixed_position_velocity_controller/command std_msgs/Float64 -- 10
And I tried to make this with code.
import roslib; roslib.load_manifest('rospy_tutorials')
import rospy
from std_msgs.msg import *
def talker():
pub = rospy.Publisher('sh_ffj3_mixed_position_velocity_controller/command', Float64)
rospy.init_node('ffj3Control')
value = 10
rospy.loginfo(value)
pub.publish(Float64(value))
if __name__ == '__main__':
try:
talker()
except rospy.ROSInterruptException: pass
But this didn't work. The model in the gazebo gui does not move.
This the result of this execution:
/opt/ros/fuerte/share/rospy_tutorials$ rosrun beginner_tutorials talker.py[INFO] [WallTime: 1365084692.814065] [0.000000] 10
Anyone knows what is wrong?