37 #ifndef LASER_CB_DETECTOR_LASER_CB_DETECTOR_H_ 38 #define LASER_CB_DETECTOR_LASER_CB_DETECTOR_H_ 40 #include <opencv/cv.h> 41 #include <calibration_msgs/DenseLaserSnapshot.h> 42 #include <laser_cb_detector/ConfigAction.h> 45 #include <calibration_msgs/CalibrationPattern.h> 46 #include <sensor_msgs/Image.h> 58 bool detect(
const calibration_msgs::DenseLaserSnapshot& snapshot,
59 calibration_msgs::CalibrationPattern& result);
61 bool getImage(
const calibration_msgs::DenseLaserSnapshot& snapshot, sensor_msgs::Image& ros_image);
bool detect(const calibration_msgs::DenseLaserSnapshot &snapshot, calibration_msgs::CalibrationPattern &result)
bool getImage(const calibration_msgs::DenseLaserSnapshot &snapshot, sensor_msgs::Image &ros_image)
image_cb_detector::ImageCbDetector detector_
bool configure(const ConfigGoal &config)