50 #include "sensor_msgs/Image.h" 51 #include "visp/vpVideoReader.h" 52 #include "sensor_msgs/SetCameraInfo.h" 55 #ifndef __visp_camera_calibration_CAMERA_H__ 56 #define __visp_camera_calibration_CAMERA_H__ 73 vpImage<unsigned char>
img_;
80 sensor_msgs::SetCameraInfo::Response &res);
83 typedef boost::function<bool (sensor_msgs::SetCameraInfo::Request&,sensor_msgs::SetCameraInfo::Response& res)>
vpImage< unsigned char > img_
ros::ServiceServer set_camera_info_service_
ros::AsyncSpinner spinner
bool setCameraInfoCallback(sensor_msgs::SetCameraInfo::Request &req, sensor_msgs::SetCameraInfo::Response &res)
service setting camera parameters.
ros::Publisher raw_image_publisher_
ros::ServiceClient calibrate_service_
boost::function< bool(sensor_msgs::SetCameraInfo::Request &, sensor_msgs::SetCameraInfo::Response &res)> set_camera_info_service_callback_t
service type declaration for calibrate service