00001 
00002 
00003 import roslib; roslib.load_manifest('pr2_calibration_propagation')
00004 import tf.transformations as transformations
00005 import rospy
00006 
00007 import math
00008 import pdb
00009 import sys
00010 
00011 try:
00012     import yaml
00013 except ImportError, e:
00014     print >> sys.stderr, "Cannot import yaml. Please make sure the pyyaml system dependency is installed"
00015     raise e
00016 
00017 
00018 def pplist(list):
00019     return ' '.join(['%2.3f'%x for x in list])
00020 
00021 
00022 
00023 def epsEq(value1, value2, eps = 1e-10):
00024     if math.fabs(value1-value2) <= eps:
00025         return 1
00026     return 0
00027 
00028 
00029 
00030 def mixed_to_float(mixed):
00031     pi = math.pi
00032     if type(mixed) == str:
00033         try:
00034             val = eval(mixed)
00035         except:
00036             print >> sys.stderr, "bad value:", mixed, "substituting zero!!\n\n"
00037             val = 0.
00038     else:
00039         val = float(mixed)
00040     return val
00041 
00042 
00043 
00044 def find_dh_param_offsets(chain_name):
00045     offsets = []
00046     for (default_params, calib_params) in zip(system_default['dh_chains'][chain_name]['dh'], system_calibrated['dh_chains'][chain_name]['dh']):
00047         
00048         diff = mixed_to_float(calib_params[0]) - mixed_to_float(default_params[0])
00049         if epsEq(diff, 0):
00050             diff = 0.
00051         offsets.append(diff)
00052 
00053     return offsets
00054 
00055 
00056 
00057 
00058 def angle_axis_to_RPY(vec):
00059     angle = math.sqrt(sum([vec[i]**2 for i in range(3)]))
00060     hsa = math.sin(angle/2.)
00061     if epsEq(angle, 0):
00062         return (0.,0.,0.)
00063     quat = [vec[0]/angle*hsa, vec[1]/angle*hsa, vec[2]/angle*hsa, math.cos(angle/2.)]
00064     rpy = quat_to_rpy(quat)
00065     return rpy
00066 
00067 def rpy_to_quat(rpy):
00068     return transformations.quaternion_from_euler(rpy[0], rpy[1], rpy[2], 'sxyz')
00069 
00070 def quat_to_rpy(q):
00071     rpy = transformations.euler_from_quaternion(q, 'sxyz')
00072     return rpy
00073 
00074 def parse_rpy(line):
00075     return [float(x) for x in line.split("rpy=\"")[1].split("\"")[0].split()]
00076 
00077 def parse_xyz(line):
00078     return [float(x) for x in line.split("xyz=\"")[1].split("\"")[0].split()]
00079 
00080 if __name__ == '__main__':
00081 
00082     rospy.init_node("propagate_config")
00083 
00084     if len(rospy.myargv()) < 5:
00085         print "Usage: ./propagate_config [initial.yaml] [calibrated.yaml] [initial.xml] [cal_output.xml]"
00086         sys.exit(0)
00087 
00088     
00089     initial_yaml_filename    = rospy.myargv()[1]
00090     calibrated_yaml_filename = rospy.myargv()[2]
00091     robot_xml_filename       = rospy.myargv()[3]
00092     output_filename          = rospy.myargv()[4]
00093 
00094     
00095     system_default = yaml.load(file(initial_yaml_filename, 'r'))
00096     system_calibrated = yaml.load(file(calibrated_yaml_filename, 'r'))
00097 
00098 
00099     
00100     dh_offsets = {"right_arm_chain":[],
00101                   "left_arm_chain":[],
00102                   "head_chain":[]}
00103 
00104     dh_joint_names = {"right_arm_chain" : ['r_shoulder_pan_joint', 'r_shoulder_lift_joint', 'r_upper_arm_roll_joint', 'r_elbow_flex_joint', 'r_forearm_roll_joint', 'r_wrist_flex_joint', 'r_wrist_roll_joint'],
00105                       "left_arm_chain"  : ['l_shoulder_pan_joint', 'l_shoulder_lift_joint', 'l_upper_arm_roll_joint', 'l_elbow_flex_joint', 'l_forearm_roll_joint', 'l_wrist_flex_joint', 'l_wrist_roll_joint'],
00106                       "head_chain"      : ['head_pan_joint', 'head_tilt_joint'] }
00107 
00108     
00109     chains_to_remove = [x for x in dh_offsets.keys() if x not in system_default['dh_chains'].keys()];
00110     print "Need to ignore the following chains:", chains_to_remove
00111     for chain_to_remove in chains_to_remove:
00112       del dh_offsets[chain_to_remove]
00113 
00114     print "Computing All dh chain offsets"
00115     for chain_name in dh_offsets.keys():
00116         dh_offsets[chain_name] = find_dh_param_offsets(chain_name)
00117         print "%s offsets:" % chain_name, pplist(dh_offsets[chain_name])
00118 
00119     
00120     joint_offsets_list = []
00121     for chain_name in dh_offsets.keys():
00122         joint_offsets_list.extend(zip(dh_joint_names[chain_name], dh_offsets[chain_name]))
00123     joint_offsets = dict(joint_offsets_list)
00124     foundjointnames = []
00125 
00126     
00127     transformdict = dict()
00128     for(name, rotvect) in system_calibrated['transforms'].iteritems():
00129         floatvect = [mixed_to_float(x) for x in rotvect]
00130         
00131         transformdict[name] = tuple(list(angle_axis_to_RPY(floatvect[3:6])) + floatvect[0:3])
00132 
00133     
00134     floatvect = [mixed_to_float(x) for x in system_calibrated['tilting_lasers']['tilt_laser']['before_joint'] ]
00135     transformdict['laser_tilt_mount_joint'] = tuple(list(angle_axis_to_RPY(floatvect[3:6])) + floatvect[0:3])
00136 
00137     
00138     
00139     
00140     
00141 
00142     floatvect = [mixed_to_float(x) for x in system_calibrated['tilting_lasers']['tilt_laser']['after_joint'] ]
00143     transformdict['laser_tilt_joint'] = tuple(list(angle_axis_to_RPY(floatvect[3:6])) + floatvect[0:3])
00144 
00145     foundtransforms = []
00146 
00147     
00148     xmllines = file(robot_xml_filename, 'r').readlines()
00149     outfile = file(output_filename, 'w')
00150     lineind = 0
00151     while(lineind < len(xmllines)):
00152         looking_for_calibration_pos = 0
00153         looking_for_origin = 0
00154         
00155         for joint_name in joint_offsets.keys():
00156             search_string = joint_name + "\" type="
00157             if search_string in xmllines[lineind]:
00158                 
00159                 print "Found joint: ", joint_name
00160                 foundjointnames.append(joint_name)
00161                 looking_for_calibration_pos = 1
00162                 break
00163 
00164         
00165         for (transform_name, rpy_trans) in transformdict.iteritems():
00166             if transform_name+"\" type=" in xmllines[lineind]:
00167 
00168                 
00169                 print "found transform for", transform_name
00170                 foundtransforms.append(transform_name)
00171                 looking_for_origin = 1
00172                 break
00173 
00174         if looking_for_calibration_pos or looking_for_origin:
00175             
00176             searchind = 0
00177             joint_lines = []
00178             while(searchind < 50):
00179                 joint_lines.append(xmllines[searchind+lineind])
00180                 if "</joint>" in xmllines[searchind+lineind]:
00181                     lineind += searchind
00182                     break
00183                 searchind += 1
00184             else:
00185                 print >> sys.stderr, "looked for 50 lines and didn't find what we were looking for.  Is the joint description more than 50 lines?  Go change this script, if so.\n\n\n"
00186 
00187             print "Extracted joint:"
00188             print "------"
00189             for joint_line_ind, cur_line in zip(range(len(joint_lines)), joint_lines):
00190                 print "% 2u)" % joint_line_ind, cur_line
00191             print "------"
00192 
00193             
00194             axis_xyz = None
00195             origin_rpy = None
00196             origin_xyz = None
00197             origin_ind = None
00198 
00199             
00200             calibration_ind = None
00201             calibration_ref_pos = None
00202             calibration_rising = None
00203             calibration_falling = None
00204 
00205 
00206             for joint_line_ind in range(len(joint_lines)):
00207                 if "<axis " in joint_lines[joint_line_ind]:
00208                     print "  Found axis tag at line %u" % joint_line_ind
00209                     axis_xyz = parse_xyz(joint_lines[joint_line_ind])
00210                     print "    xyz: %s" % axis_xyz
00211                 if "<origin " in joint_lines[joint_line_ind]:
00212                     print "  Found origin tag at line %u" % joint_line_ind
00213                     origin_ind = joint_line_ind
00214 
00215                     
00216                     origin_xyz = parse_xyz(joint_lines[joint_line_ind])
00217                     origin_rpy = parse_rpy(joint_lines[joint_line_ind])
00218                     print "    xyz: %s" % origin_xyz
00219                     print "    rpy: %s" % origin_rpy
00220                 if "<calibration " in joint_lines[joint_line_ind]:
00221                     print "  Found calibration tag at line %u" % joint_line_ind
00222                     calibration_ind = joint_line_ind
00223                     if "reference_position" in joint_lines[calibration_ind]:
00224                         calibration_ref_pos = float(joint_lines[calibration_ind].split("reference_position=\"")[1].split("\"")[0])
00225                         print "    reference position: %f" % calibration_ref_pos
00226                     if "rising" in joint_lines[calibration_ind]:
00227                         calibration_rising = float(joint_lines[calibration_ind].split("rising=\"")[1].split("\"")[0])
00228                         print "    rising edge: %f" % calibration_rising
00229                     if "falling" in joint_lines[calibration_ind]:
00230                         calibration_falling = float(joint_lines[calibration_ind].split("falling=\"")[1].split("\"")[0])
00231                         print "    falling edge: %f" % calibration_falling
00232 
00233                     
00234 
00235             
00236             if looking_for_origin:
00237                 print "  Doing a transform update"
00238                 tag_split = joint_lines[origin_ind].split('/>')
00239                 if len(tag_split) == 1:
00240                     oldlineending = ""
00241                 else:
00242                     oldlineending = tag_split[1]
00243                 newline = "\t<origin rpy=\"%.10f %.10f %.10f\" xyz=\"%.10f %.10f %.10f\"/>"%rpy_trans + oldlineending
00244                 print "    transform old line:", joint_lines[origin_ind].strip()
00245                 print "    transform new line:", newline.strip()
00246                 joint_lines[origin_ind] = newline
00247             if looking_for_calibration_pos:
00248                 print "  Doing a calibration position update"
00249                 print "    Shifting by: %f" % joint_offsets[joint_name]
00250 
00251                 
00252                 tag_split = joint_lines[calibration_ind].split('/>')
00253                 if len(tag_split) == 1:
00254                     oldlineending = ""
00255                 else:
00256                     oldlineending = "/>".join(tag_split[1:])
00257 
00258                 ref_pos_text = ""
00259                 rising_text = ""
00260                 falling_text = ""
00261 
00262                 if calibration_ref_pos is not None:
00263                     ref_pos_text = "reference_position=\"%.10f\"" % (calibration_ref_pos + joint_offsets[joint_name])
00264 
00265                 if calibration_rising is not None:
00266                     rising_text = "rising=\"%.10f\"" % (calibration_rising + joint_offsets[joint_name])
00267 
00268                 if calibration_falling is not None:
00269                     falling_text = "falling=\"%.10f\"" % (calibration_falling + joint_offsets[joint_name])
00270 
00271                 newline = "\t<calibration %s %s %s/>" % (ref_pos_text, rising_text, falling_text) + oldlineending
00272                 print "    calibration old line:", joint_lines[calibration_ind].strip()
00273                 print "    calibration new line:", newline.strip()
00274                 joint_lines[calibration_ind] = newline
00275 
00276             for cur_line in joint_lines:
00277                 outfile.write(cur_line)
00278 
00279         else:
00280             
00281             outfile.write(xmllines[lineind])
00282         lineind += 1
00283 
00284     outfile.close()
00285 
00286     
00287     notfoundtransforms = transformdict.keys()
00288     for transform in foundtransforms:
00289         try:
00290             notfoundtransforms.remove(transform)
00291         except:
00292             print >> sys.stderr, "transform", transform, "found and changed twice, oops!!!\n\n"
00293     print "transforms never found:", notfoundtransforms
00294 
00295     notfoundjointnames = joint_offsets.keys()
00296     for jointname in foundjointnames:
00297         try:
00298             notfoundjointnames.remove(jointname)
00299         except:
00300             print >> sys.stderr, "jointname", jointname, "found and changed twice, oops!!!\n\n"
00301     print "jointnames never found:", notfoundjointnames