Go to the documentation of this file.00001 from camera_calibration_parsers.camera_calibration_parsers_wrapper import __readCalibrationWrapper
00002 from sensor_msgs.msg import CameraInfo
00003
00004 def readCalibration(file_name):
00005 """Read .ini or .yaml calibration file and return (camera name and cameraInfo message).
00006
00007 @param file_name: camera calibration file name
00008 @type file_name: str
00009 @return: (camera name, cameraInfo message) or None on Error
00010 @rtype: tuple(str, sensor_msgs.msg.CameraInfo | None
00011 """
00012 ret, cn, ci = __readCalibrationWrapper(file_name)
00013 if not ret:
00014 return None
00015 c = CameraInfo()
00016 c.deserialize(ci)
00017 return cn, c