joint_state_remapper.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 # -*- coding: utf-8 -*-
3 """
4 Created on Tue Aug 14 14:44:13 2018
5 
6 @author: st-ros
7 """
8 
9 import rospy
10 
11 import arm
12 
13 from control_msgs.msg import (FollowJointTrajectoryActionFeedback)
14 
15 from sensor_msgs.msg import (JointState)
16 
17 from math import pi
18 
19 RATIOS = [3640, 8400, 6000, 4000, 4500] #Joint motor counts corresponding to 90 degree rotation
20 
21 state = JointState()
22 arm = arm.Arm()
23 
25  '''Reorganise waist-to-wrist ordered joint counts into alphabetical angle values for ros publishing'''
26  out = [0, 0, 0, 0, 0]
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)))
32  return(out)
33 
34 def callback(data):
35  '''Upon recieving new position data from feedback, update the position data to be published'''
36  state.position = data.feedback.actual.positions #Sets the joint positions in the JointState message to the joint positions in the action feedback
37 
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']
41  arm.connect() #Initialises connection to r12 arm
42  state.position = [0,0,0,0,0]
43  state.position = joint_to_angle(arm.read_pos(state.position)) #Checks current position of arm and sets starting position to it
44  pub = rospy.Publisher('/joint_states', JointState, queue_size=10) #Initialises publishing
45  rospy.init_node('joint_state_remapper', anonymous=True)
46  rospy.loginfo('Successful init')
47  rospy.loginfo(state.position)
48  rate = rospy.Rate(20)
49  rospy.Subscriber("/r12_arm_controller/follow_joint_trajectory/feedback", FollowJointTrajectoryActionFeedback, callback) #Initialises subscribing
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())
53  pub.publish(state) #While running, publish last known joint state
54  rate.sleep()
55 
56 if __name__ == '__main__':
58 
Definition: arm.py:90


r12_hardware_interface
Author(s): Andreas Hogstrand
autogenerated on Mon Feb 28 2022 23:20:33