Go to the documentation of this file.00001 #ifndef CAMERA_CALIBRATION_PARSERS_PARSE_H
00002 #define CAMERA_CALIBRATION_PARSERS_PARSE_H
00003
00004 #include <string>
00005 #include <sensor_msgs/CameraInfo.h>
00006
00008 namespace camera_calibration_parsers {
00009
00019 bool writeCalibration(const std::string& file_name, const std::string& camera_name,
00020 const sensor_msgs::CameraInfo& cam_info);
00021
00031 bool readCalibration(const std::string& file_name, std::string& camera_name,
00032 sensor_msgs::CameraInfo& cam_info);
00033
00042 bool parseCalibration(const std::string& buffer, const std::string& format,
00043 std::string& camera_name, sensor_msgs::CameraInfo& cam_info);
00044
00045 }
00046
00047 #endif