38 #ifndef _CAMERA_INFO_MANAGER_H_
39 #define _CAMERA_INFO_MANAGER_H_
42 #include <boost/thread/mutex.hpp>
43 #include <sensor_msgs/CameraInfo.h>
44 #include <sensor_msgs/SetCameraInfo.h>
50 #ifdef ROS_BUILD_SHARED_LIBS // ros is being built around shared libraries
51 #ifdef camera_info_manager_EXPORTS // we are building a shared lib/dll
52 #define CAMERA_INFO_MANAGER_DECL ROS_HELPER_EXPORT
53 #else // we are using shared lib/dll
54 #define CAMERA_INFO_MANAGER_DECL ROS_HELPER_IMPORT
56 #else // ros is being built around static libraries
57 #define CAMERA_INFO_MANAGER_DECL
193 const std::string &cname=
"camera",
194 const std::string &url=
"");
197 virtual sensor_msgs::CameraInfo getCameraInfo(
void);
198 virtual bool isCalibrated(
void);
199 virtual bool loadCameraInfo(
const std::string &url);
200 virtual std::string resolveURL(
const std::string &url,
201 const std::string &cname);
202 virtual bool setCameraName(
const std::string &cname);
203 virtual bool setCameraInfo(
const sensor_msgs::CameraInfo &camera_info);
204 virtual bool validateURL(
const std::string &url);
221 std::string getPackageFileName(
const std::string &url);
222 virtual bool loadCalibration(
const std::string &url,
223 const std::string &cname);
224 virtual bool loadCalibrationFile(
const std::string &filename,
225 const std::string &cname);
226 virtual bool loadCalibrationFlash(
const std::string &flashURL,
227 const std::string &cname);
228 url_type_t parseURL(
const std::string &url);
229 virtual bool saveCalibration(
const sensor_msgs::CameraInfo &new_info,
230 const std::string &url,
231 const std::string &cname);
232 virtual bool saveCalibrationFile(
const sensor_msgs::CameraInfo &new_info,
233 const std::string &filename,
234 const std::string &cname);
235 virtual bool saveCalibrationFlash(
const sensor_msgs::CameraInfo &new_info,
236 const std::string &flashURL,
237 const std::string &cname);
238 virtual bool setCameraInfoService(sensor_msgs::SetCameraInfo::Request &req,
239 sensor_msgs::SetCameraInfo::Response &rsp);
263 #endif // _CAMERA_INFO_MANAGER_H_