You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
I used the rostopic echo /joint_states to get the trajectory. And I want to make fetch move following the specified trajectory. But when I run the following python code, fetch i gazebo did not move at all. (but the value of joint_states changed as the specified trajectory )
step 1:roslaunch fetch_gazebo playground.launch
step 2 :run the following python code
import rospy
from sensor_msgs.msg import JointState
from std_msgs.msg import String
The "joint_states" topic is an output from the drivers - it tells you where the robot is - you can't command it through that interface. To send commands to the robot, you need to use one of the action-based interfaces - see http://docs.fetchrobotics.com/api_overview.html#arm-and-torso
I used the rostopic echo /joint_states to get the trajectory. And I want to make fetch move following the specified trajectory. But when I run the following python code, fetch i gazebo did not move at all. (but the value of joint_states changed as the specified trajectory )
step 1:roslaunch fetch_gazebo playground.launch
step 2 :run the following python code
import rospy
from sensor_msgs.msg import JointState
from std_msgs.msg import String
def talker():
rospy.init_node('talker', anonymous=True)
pub = rospy.Publisher('/joint_states', JointState, queue_size=1)
rate = rospy.Rate(10)
States=JointState();
if name == 'main':
try:
talker()
except rospy.ROSInterruptException:
pass
The text was updated successfully, but these errors were encountered: