18 from sensor_msgs.msg 
import JointState
    19 from sr_utilities.srv 
import getJointState
    27         rospy.init_node(
'get_joint_state_service', anonymous=
True)
    34         self.
mutex = thread.allocate_lock()
    37         while not rospy.is_shutdown():
    47 if __name__ == 
'__main__':
 
def getJointStateCB(self, req)
 
def callback1(self, data)