35 #ifndef CAMERA_CALIBRATION_PARSERS_PARSE_H
36 #define CAMERA_CALIBRATION_PARSERS_PARSE_H
39 #include <sensor_msgs/CameraInfo.h>
53 bool writeCalibration(
const std::string& file_name,
const std::string& camera_name,
54 const sensor_msgs::CameraInfo& cam_info);
65 bool readCalibration(
const std::string& file_name, std::string& camera_name,
66 sensor_msgs::CameraInfo& cam_info);
77 std::string& camera_name, sensor_msgs::CameraInfo& cam_info);