$search
#include <laser_cb_detector.h>
| Public Member Functions | |
| bool | configure (const ConfigGoal &config) | 
| bool | detect (const calibration_msgs::DenseLaserSnapshot &snapshot, calibration_msgs::CalibrationPattern &result) | 
| bool | getImage (const calibration_msgs::DenseLaserSnapshot &snapshot, sensor_msgs::Image &ros_image) | 
| LaserCbDetector () | |
| Private Attributes | |
| CvLaserBridge | bridge_ | 
| ConfigGoal | config_ | 
| bool | configured_ | 
Definition at line 50 of file laser_cb_detector.h.
| LaserCbDetector::LaserCbDetector | ( | ) | 
Definition at line 45 of file laser_cb_detector.cpp.
| bool LaserCbDetector::configure | ( | const ConfigGoal & | config | ) | 
Definition at line 52 of file laser_cb_detector.cpp.
| bool LaserCbDetector::detect | ( | const calibration_msgs::DenseLaserSnapshot & | snapshot, | |
| calibration_msgs::CalibrationPattern & | result | |||
| ) | 
Definition at line 60 of file laser_cb_detector.cpp.
| bool LaserCbDetector::getImage | ( | const calibration_msgs::DenseLaserSnapshot & | snapshot, | |
| sensor_msgs::Image & | ros_image | |||
| ) | 
Definition at line 149 of file laser_cb_detector.cpp.
Definition at line 65 of file laser_cb_detector.h.
Definition at line 64 of file laser_cb_detector.h.
| bool laser_cb_detector::LaserCbDetector::configured_  [private] | 
Definition at line 63 of file laser_cb_detector.h.