3 from sensor_msgs.msg
import JointState
4 from sr_utilities.srv
import getJointState
12 rospy.init_node(
'get_joint_state_service', anonymous=
True)
19 self.
mutex = thread.allocate_lock()
22 while not rospy.is_shutdown():
32 if __name__ ==
'__main__':
def getJointStateCB(self, req)
def callback1(self, data)