18 from sensor_msgs.msg 
import JointState
    24         rospy.init_node(
'joint_state_merger', anonymous=
True)
    25         self.
subs_1 = rospy.Subscriber(
"/srh/position/joint_states", JointState, self.
callback1)
    26         self.
subs_2 = rospy.Subscriber(
"/sr_arm/position/joint_states", JointState, self.
callback2)
    28         self.
pub = rospy.Publisher(
"/joint_states", JointState)
    35         self.
mutex = thread.allocate_lock()
   108 if __name__ == 
'__main__':
 
def callback2(self, data)
 
def callback1(self, data)