calibration_export.cpp
Go to the documentation of this file.
1 /*
2  * Copyright (C) 2018-2022 Michael Ferguson
3  * Copyright (C) 2015 Fetch Robotics Inc.
4  * Copyright (C) 2013-2014 Unbounded Robotics Inc.
5  *
6  * Licensed under the Apache License, Version 2.0 (the "License");
7  * you may not use this file except in compliance with the License.
8  * You may obtain a copy of the License at
9  *
10  * http://www.apache.org/licenses/LICENSE-2.0
11  *
12  * Unless required by applicable law or agreed to in writing, software
13  * distributed under the License is distributed on an "AS IS" BASIS,
14  * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
15  * See the License for the specific language governing permissions and
16  * limitations under the License.
17  */
18 
19 // Author: Michael Ferguson
20 
21 #include <fstream>
22 #include <sstream>
25 
26 namespace robot_calibration
27 {
28 bool exportResults(Optimizer& optimizer, const std::string& initial_urdf,
29  const std::vector<robot_calibration_msgs::CalibrationData>& data)
30 {
31  // Generate datecode
32  char datecode[80];
33  {
34  std::time_t t = std::time(NULL);
35  std::strftime(datecode, 80, "%Y_%m_%d_%H_%M_%S", std::localtime(&t));
36  }
37 
38  // Save updated URDF
39  {
40  std::string s = optimizer.getOffsets()->updateURDF(initial_urdf);
41  std::stringstream urdf_name;
42  urdf_name << "/tmp/calibrated_" << datecode << ".urdf";
43  std::ofstream file;
44  file.open(urdf_name.str().c_str());
45  file << s;
46  file.close();
47  }
48 
49  // Output camera calibration(s)
50  std::vector<std::string> camera_names = optimizer.getCameraNames();
51  for (auto it = camera_names.begin(); it != camera_names.end(); ++it)
52  {
53  // Find original CameraInfo
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)
58  {
59  if (obs->sensor_name == *it)
60  {
61  camera_info = obs->ext_camera_info.camera_info;
62  found_camera_info = true;
63  break;
64  }
65  }
66 
67  if (!found_camera_info)
68  {
69  ROS_WARN("Unable to export camera_info for %s", it->c_str());
70  continue;
71  }
72 
73  std::stringstream depth_name;
74  depth_name << "/tmp/depth_";
75  if (*it != "camera")
76  {
77  // We include the name if the name is not "camera" for backwards compatability
78  depth_name << *it << "_";
79  }
80  depth_name << datecode << ".yaml";
83  optimizer.getOffsets()->get(*it + "_fx"),
84  optimizer.getOffsets()->get(*it + "_fy"),
85  optimizer.getOffsets()->get(*it + "_cx"),
86  optimizer.getOffsets()->get(*it + "_cy"),
87  camera_info));
88 
89  std::stringstream rgb_name;
90  rgb_name << "/tmp/rgb_";
91  if (*it != "camera")
92  {
93  // We include the name if the name is not "camera" for backwards compatability
94  rgb_name << *it << "_";
95  }
96  rgb_name << datecode << ".yaml";
99  optimizer.getOffsets()->get(*it + "_fx"),
100  optimizer.getOffsets()->get(*it + "_fy"),
101  optimizer.getOffsets()->get(*it + "_cx"),
102  optimizer.getOffsets()->get(*it + "_cy"),
103  camera_info));
104  }
105 
106  // Output the calibration yaml
107  {
108  std::stringstream yaml_name;
109  yaml_name << "/tmp/calibration_" << datecode << ".yaml";
110  std::ofstream file;
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;
116  file.close();
117  }
118 
119  return true;
120 }
121 
122 } // namespace robot_calibration
s
XmlRpcServer s
robot_calibration::Optimizer::getCameraNames
std::vector< std::string > getCameraNames()
Get the names of all camera models.
Definition: optimizer.cpp:399
camera_calibration_parsers::writeCalibration
bool writeCalibration(const std::string &file_name, const std::string &camera_name, const sensor_msgs::CameraInfo &cam_info)
robot_calibration::Optimizer::getOffsets
boost::shared_ptr< CalibrationOffsetParser > getOffsets()
Definition: optimizer.h:68
robot_calibration::Optimizer
Class to do optimization.
Definition: optimizer.h:42
ROS_WARN
#define ROS_WARN(...)
robot_calibration
Calibration code lives under this namespace.
Definition: base_calibration.h:28
parse.h
robot_calibration::updateCameraInfo
sensor_msgs::CameraInfo updateCameraInfo(double camera_fx, double camera_fy, double camera_cx, double camera_cy, const sensor_msgs::CameraInfo &info)
Update the camera calibration with the new offsets.
Definition: camera_info.h:54
robot_calibration::exportResults
bool exportResults(Optimizer &optimizer, const std::string &initial_urdf, const std::vector< robot_calibration_msgs::CalibrationData > &data)
Write the outputs of a calibration.
Definition: calibration_export.cpp:28
t
geometry_msgs::TransformStamped t
export.h


robot_calibration
Author(s): Michael Ferguson
autogenerated on Fri Sep 1 2023 02:52:01