29 const std::vector<robot_calibration_msgs::CalibrationData>& data)
34 std::time_t
t = std::time(NULL);
35 std::strftime(datecode, 80,
"%Y_%m_%d_%H_%M_%S", std::localtime(&
t));
40 std::string
s = optimizer.
getOffsets()->updateURDF(initial_urdf);
41 std::stringstream urdf_name;
42 urdf_name <<
"/tmp/calibrated_" << datecode <<
".urdf";
44 file.open(urdf_name.str().c_str());
50 std::vector<std::string> camera_names = optimizer.
getCameraNames();
51 for (
auto it = camera_names.begin(); it != camera_names.end(); ++it)
54 sensor_msgs::CameraInfo camera_info;
55 bool found_camera_info =
false;
56 for (
auto obs = data.front().observations.begin();
57 obs != data.front().observations.end(); ++obs)
59 if (obs->sensor_name == *it)
61 camera_info = obs->ext_camera_info.camera_info;
62 found_camera_info =
true;
67 if (!found_camera_info)
69 ROS_WARN(
"Unable to export camera_info for %s", it->c_str());
73 std::stringstream depth_name;
74 depth_name <<
"/tmp/depth_";
78 depth_name << *it <<
"_";
80 depth_name << datecode <<
".yaml";
89 std::stringstream rgb_name;
90 rgb_name <<
"/tmp/rgb_";
94 rgb_name << *it <<
"_";
96 rgb_name << datecode <<
".yaml";
108 std::stringstream yaml_name;
109 yaml_name <<
"/tmp/calibration_" << datecode <<
".yaml";
111 file.open(yaml_name.str().c_str());
112 file << optimizer.
getOffsets()->getOffsetYAML();
113 file <<
"depth_info: depth_" << datecode <<
".yaml" << std::endl;
114 file <<
"rgb_info: rgb_" << datecode <<
".yaml" << std::endl;
115 file <<
"urdf: calibrated_" << datecode <<
".urdf" << std::endl;