4 Created on Tue Aug 14 14:44:13 2018 13 from control_msgs.msg
import (FollowJointTrajectoryActionFeedback)
15 from sensor_msgs.msg
import (JointState)
19 RATIOS = [3640, 8400, 6000, 4000, 4500]
25 '''Reorganise waist-to-wrist ordered joint counts into alphabetical angle values for ros publishing''' 27 out[0] = float(-(li[2]*pi/(RATIOS[2]*2)))
28 out[1] = float(-(li[3]*pi/(RATIOS[3]*2)))
29 out[2] = float(-(li[1]*pi/(RATIOS[1]*2)))
30 out[3] = float(-(li[0]*pi/(RATIOS[0]*2)))
31 out[4] = float((li[4]*pi/(RATIOS[4]*2)))
35 '''Upon recieving new position data from feedback, update the position data to be published''' 36 state.position = data.feedback.actual.positions
39 '''Continuously publishes the last heard position from JointTrajectoryActionFeedback to the joint_states topic''' 40 state.name = [
'elbow_joint',
'hand_joint',
'shoulder_joint',
'waist_joint',
'wrist_joint']
42 state.position = [0,0,0,0,0]
44 pub = rospy.Publisher(
'/joint_states', JointState, queue_size=10)
45 rospy.init_node(
'joint_state_remapper', anonymous=
True)
46 rospy.loginfo(
'Successful init')
47 rospy.loginfo(state.position)
49 rospy.Subscriber(
"/r12_arm_controller/follow_joint_trajectory/feedback", FollowJointTrajectoryActionFeedback, callback)
50 rospy.loginfo(
'Ready: now remapping joint feedback')
51 while not rospy.is_shutdown():
52 state.header.stamp = rospy.Duration.from_sec(rospy.get_time())
56 if __name__ ==
'__main__':
def joint_state_remapper()