urdf_unittest.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 # Software License Agreement (BSD License)
3 #
4 # Copyright (c) 2011, Willow Garage, Inc.
5 # All rights reserved.
6 #
7 # Redistribution and use in source and binary forms, with or without
8 # modification, are permitted provided that the following conditions
9 # are met:
10 #
11 # * Redistributions of source code must retain the above copyright
12 # notice, this list of conditions and the following disclaimer.
13 # * Redistributions in binary form must reproduce the above
14 # copyright notice, this list of conditions and the following
15 # disclaimer in the documentation and/or other materials provided
16 # with the distribution.
17 # * Neither the name of Willow Garage, Inc. nor the names of its
18 # contributors may be used to endorse or promote products derived
19 # from this software without specific prior written permission.
20 #
21 # THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
22 # "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
23 # LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
24 # FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
25 # COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
26 # INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
27 # BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
28 # LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
29 # CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
30 # LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
31 # ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
32 # POSSIBILITY OF SUCH DAMAGE.
33 
34 import roslib; roslib.load_manifest('calibration_estimation')
35 
36 import sys
37 import unittest
38 import rospy
39 import time
40 import numpy
41 import yaml
42 
43 from calibration_estimation.urdf_params import UrdfParams
45 
46 raw_xml = 'robot.xml'
47 calibrated_xml = 'robot_calibrated.xml'
48 
49 def loadSystem():
50  robot_description = get_robot_description('/tmp/pr2_calibration/cal_measurements.bag')
51  outfile = open(raw_xml, 'w')
52  outfile.write(robot_description)
53  outfile.close()
54  config = yaml.load('''
55 sensors:
56  chains: {}
57  rectified_cams: {}
58  tilting_lasers: {}
59 transforms: {}
60 checkerboards: {}
61 ''')
62  return UrdfParams(robot_description, config)
63 
64 class TestUrdfWriter(unittest.TestCase):
65  def test_write(self):
66  print ""
67  params = loadSystem()
68  outfile = open(calibrated_xml, 'w')
69  outfile.write( params.urdf.to_xml() )
70  outfile.close()
71 
72 if __name__ == '__main__':
73  import rostest
74  rostest.unitrun('calibration_estimation', 'test_UrdfWriter', TestUrdfWriter, coverage_packages=['calibration_estimation.urdf_params'])
def get_robot_description(bag_filename, use_topic=False)


calibration_estimation
Author(s): Vijay Pradeep, Michael Ferguson
autogenerated on Thu Jun 6 2019 19:17:16