sr_left_demo1_unsafe.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 import rospy
00004 from sr_robot_commander.sr_arm_commander import SrArmCommander
00005 from sr_robot_commander.sr_hand_commander import SrHandCommander
00006 
00007 
00008 rospy.init_node("basic_arm_examples", anonymous=True)
00009 
00010 hand_commander = SrHandCommander(name="left_hand", prefix="lh")
00011 arm_commander = SrArmCommander(name="left_arm", set_ground=False)
00012 
00013 hand_joint_states_1 = {'lh_RFJ2': 1.5872158005941464, 'lh_RFJ3': 1.4895168741913918, 'lh_RFJ1': 1.4666237408137237,
00014                        'lh_RFJ4': -0.013050215160411582, 'lh_LFJ4': 0.01625614455626714, 'lh_LFJ5': 0.06044670177162791,
00015                        'lh_LFJ1': 1.407234521173739, 'lh_LFJ2': 1.6004770713418932, 'lh_LFJ3': 1.4891552968918866,
00016                        'lh_THJ2': 0.6375448576161045, 'lh_THJ3': -0.08707199480655038, 'lh_THJ1': 0.4292303516130266,
00017                        'lh_THJ4': 0.4910109864772066, 'lh_THJ5': 0.3494250743459288, 'lh_FFJ4': -0.023940821288538697,
00018                        'lh_FFJ2': 1.705298764563267, 'lh_FFJ3': 1.486354199529797, 'lh_FFJ1': 1.2470199410677854,
00019                        'lh_MFJ3': 1.486614783269636, 'lh_MFJ2': 1.6564932487003736, 'lh_MFJ1': 1.3140315426072693,
00020                        'lh_MFJ4': -0.0242471489068632, 'lh_WRJ2': -0.02486374414999284, 'lh_WRJ1': 0.029153388390064056}
00021 hand_joint_states_2 = {'lh_RFJ2': 0.5478785575312844, 'lh_RFJ3': 0.08445184105173437, 'lh_RFJ1': 0.029420452374822992,
00022                        'lh_RFJ4': -0.15015641393093462, 'lh_LFJ4': -0.3537140525902314, 'lh_LFJ5': 0.23522928790906183,
00023                        'lh_LFJ1': 0.016491300018844024, 'lh_LFJ2': 0.49407520333290567,
00024                        'lh_LFJ3': -0.020286553857819023, 'lh_THJ2': -0.08248675629081387,
00025                        'lh_THJ3': -0.0848751638665582, 'lh_THJ1': 0.15119341005233636, 'lh_THJ4': 0.555946758562008,
00026                        'lh_THJ5': -0.16597727036313847, 'lh_FFJ4': -0.33742084583325016, 'lh_FFJ2': 0.29498522568918245,
00027                        'lh_FFJ3': 0.15909058345101856, 'lh_FFJ1': 0.008391006019203506, 'lh_MFJ3': 0.19261624130519672,
00028                        'lh_MFJ2': 0.4993988321882934, 'lh_MFJ1': 0.0018180513041607393, 'lh_MFJ4': -0.06813011563236507,
00029                        'lh_WRJ2': -0.029337204975412538, 'lh_WRJ1': -0.024214584973550318}
00030 hand_joint_states_3 = {'lh_RFJ2': 0.6281074021794109, 'lh_RFJ3': 0.7659888823679098, 'lh_RFJ1': 0.03325790268458251,
00031                        'lh_RFJ4': -0.01845843339542446, 'lh_LFJ4': -0.3151306683738226, 'lh_LFJ5': 0.6682392109822538,
00032                        'lh_LFJ1': 0.02267553752591056, 'lh_LFJ2': 0.7320423099057738, 'lh_LFJ3': 0.21083959411165956,
00033                        'lh_THJ2': -0.05850835753848048, 'lh_THJ3': -0.03831702846125888, 'lh_THJ1': 0.3880903237967719,
00034                        'lh_THJ4': 0.8542756038519191, 'lh_THJ5': 0.3977832749115066, 'lh_FFJ4': -0.3461906922375515,
00035                        'lh_FFJ2': 0.9047110422867736, 'lh_FFJ3': 0.5607576049255242, 'lh_FFJ1': 0.020697814847368656,
00036                        'lh_MFJ3': 0.5934438572029458, 'lh_MFJ2': 0.8413647783663876, 'lh_MFJ1': 0.05045092369046106,
00037                        'lh_MFJ4': -0.0763291870248651, 'lh_WRJ2': -0.03623944626996376, 'lh_WRJ1': 0.15273292976946237}
00038 hand_joint_states_4 = {'lh_RFJ2': 0.5689914113860546, 'lh_RFJ3': 0.2699064481161507, 'lh_RFJ1': 0.044770253613861055,
00039                        'lh_RFJ4': -0.01310439794863375, 'lh_LFJ4': -0.27636350128170994, 'lh_LFJ5': 0.3923167588877166,
00040                        'lh_LFJ1': 0.005668884381477612, 'lh_LFJ2': 0.7213711392074389, 'lh_LFJ3': -0.12022805250412126,
00041                        'lh_THJ2': -0.19285193046975369, 'lh_THJ3': -0.049175771502373795, 'lh_THJ1': 0.3772016453548229,
00042                        'lh_THJ4': 0.851042148000176, 'lh_THJ5': -0.10598914088076919, 'lh_FFJ4': -0.32111300494638306,
00043                        'lh_FFJ2': 0.6403305026287431, 'lh_FFJ3': -0.033504455579867615, 'lh_FFJ1': 0.03636102608321523,
00044                        'lh_MFJ3': 0.03648567566570239, 'lh_MFJ2': 0.8329697861210468, 'lh_MFJ1': 0.009090256520803808,
00045                        'lh_MFJ4': -0.05363466958654512, 'lh_WRJ2': -0.02912809841748016, 'lh_WRJ1': 0.15505134454423647}
00046 hand_joint_states_5 = {'lh_RFJ2': 1.583110932144334, 'lh_RFJ3': 1.5194606949913108, 'lh_RFJ1': 1.3397225906184769,
00047                        'lh_RFJ4': -0.06020330131439302, 'lh_LFJ4': -0.19643249787043804, 'lh_LFJ5': 0.09445042306544366,
00048                        'lh_LFJ1': 1.4705487685109613, 'lh_LFJ2': 1.5685131925989737, 'lh_LFJ3': 1.395806825047366,
00049                        'lh_THJ2': -0.0076095150843690645, 'lh_THJ3': -0.04107203065574469,
00050                        'lh_THJ1': 0.29468156960530606, 'lh_THJ4': 0.5994495871408213, 'lh_THJ5': -1.3629363677138682,
00051                        'lh_FFJ4': 0.027566020957249734, 'lh_FFJ2': 1.7233124839072451, 'lh_FFJ3': 1.407416123169923,
00052                        'lh_FFJ1': 1.2125585930819789, 'lh_MFJ3': 1.399505129145413, 'lh_MFJ2': 1.6508429022011113,
00053                        'lh_MFJ1': 1.3258988225487143, 'lh_MFJ4': 0.1162845586275759, 'lh_WRJ2': -0.04645869454675692,
00054                        'lh_WRJ1': 0.16639311705105272}
00055 
00056 arm_joint_states_1 = {'la_shoulder_lift_joint': -1.8675444761859339, 'la_elbow_joint': 1.762739658355713,
00057                       'la_wrist_2_joint': 0.034899186342954636, 'la_wrist_1_joint': -0.855201546345846,
00058                       'la_shoulder_pan_joint': -2.6354027430163782, 'la_wrist_3_joint': 0.6980043649673462}
00059 arm_joint_states_2 = {'la_shoulder_lift_joint': -1.858894173298971, 'la_elbow_joint': 1.8534269332885742,
00060                       'la_wrist_2_joint': -0.1952908674823206, 'la_wrist_1_joint': -0.9622061888324183,
00061                       'la_shoulder_pan_joint': -1.7790520826922815, 'la_wrist_3_joint': 1.0615997314453125}
00062 arm_joint_states_3 = {'la_shoulder_lift_joint': -1.8589418570147913, 'la_elbow_joint': 1.9028244018554688,
00063                       'la_wrist_2_joint': -0.17748672166933233, 'la_wrist_1_joint': -0.9611042181598108,
00064                       'la_shoulder_pan_joint': -1.7789681593524378, 'la_wrist_3_joint': 1.0615878105163574}
00065 arm_joint_states_4 = {'la_shoulder_lift_joint': -1.3324082533465784, 'la_elbow_joint': 1.1092381477355957,
00066                       'la_wrist_2_joint': 1.0047885179519653, 'la_wrist_1_joint': 0.12960267066955566,
00067                       'la_shoulder_pan_joint': -1.493253533040182, 'la_wrist_3_joint': 3.2672297954559326}
00068 arm_joint_states_5 = {'la_shoulder_lift_joint': -1.4488886992083948, 'la_elbow_joint': 1.1080164909362793,
00069                       'la_wrist_2_joint': 0.8986303806304932, 'la_wrist_1_joint': 0.45307910442352295,
00070                       'la_shoulder_pan_joint': -0.9496935049640101, 'la_wrist_3_joint': 0.09605655819177628}
00071 arm_joint_states_6 = {'la_shoulder_lift_joint': -1.3556659857379358, 'la_elbow_joint': 1.16654634475708,
00072                       'la_wrist_2_joint': 0.9602982401847839, 'la_wrist_1_joint': 0.39066922664642334,
00073                       'la_shoulder_pan_joint': -0.9169490973102015, 'la_wrist_3_joint': 0.09618838876485825}
00074 arm_joint_states_7 = {'la_shoulder_lift_joint': -1.3484209219561976, 'la_elbow_joint': 1.0440430641174316,
00075                       'la_wrist_2_joint': 1.5493569374084473, 'la_wrist_1_joint': 0.08041524887084961,
00076                       'la_shoulder_pan_joint': -1.6396897474872034, 'la_wrist_3_joint': -1.407604996358053}
00077 arm_joint_states_8 = {'la_shoulder_lift_joint': -1.5496943632708948, 'la_elbow_joint': 1.4070467948913574,
00078                       'la_wrist_2_joint': 0.023541511967778206, 'la_wrist_1_joint': 0.6106277704238892,
00079                       'la_shoulder_pan_joint': -1.549493137990133, 'la_wrist_3_joint': -0.5691126028644007}
00080 # Move hand
00081 joint_states = hand_joint_states_1
00082 rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00083 hand_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, False)
00084 # Move arm
00085 joint_states = arm_joint_states_1
00086 rospy.loginfo("Moving arm to joint states\n" + str(joint_states) + "\n")
00087 arm_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, True)
00088 
00089 # Move hand
00090 joint_states = hand_joint_states_2
00091 rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00092 hand_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, False)
00093 # Move arm
00094 joint_states = arm_joint_states_2
00095 rospy.loginfo("Moving arm to joint states\n" + str(joint_states) + "\n")
00096 arm_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, True)
00097 
00098 # Move arm
00099 joint_states = arm_joint_states_3
00100 rospy.loginfo("Moving arm to joint states\n" + str(joint_states) + "\n")
00101 arm_commander.move_to_joint_value_target_unsafe(joint_states, 1.0, True)
00102 # Move hand
00103 joint_states = hand_joint_states_3
00104 rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00105 hand_commander.move_to_joint_value_target_unsafe(joint_states, 2.0, True)
00106 
00107 # Move arm
00108 # joint_states = arm_joint_states_4
00109 # rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00110 # arm_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, True)
00111 
00112 # Move arm
00113 # joint_states = arm_joint_states_5
00114 # rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00115 # arm_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, True)
00116 
00117 # Move arm
00118 joint_states = arm_joint_states_6
00119 rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00120 arm_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, True)
00121 
00122 # Move hand
00123 joint_states = hand_joint_states_4
00124 rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00125 hand_commander.move_to_joint_value_target_unsafe(joint_states, 2.0, True)
00126 
00127 # Move arm
00128 joint_states = arm_joint_states_5
00129 rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00130 arm_commander.move_to_joint_value_target_unsafe(joint_states, 2.0, True)
00131 
00132 # Move arm
00133 joint_states = arm_joint_states_7
00134 rospy.loginfo("Moving arm to joint states\n" + str(joint_states) + "\n")
00135 arm_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, False)
00136 # Move hand
00137 joint_states = hand_joint_states_5
00138 rospy.loginfo("Moving hand to joint states\n" + str(joint_states) + "\n")
00139 hand_commander.move_to_joint_value_target_unsafe(joint_states, 3.0, True)


sr_example
Author(s): Ugo Cupcic
autogenerated on Fri Aug 21 2015 12:25:43