This class processes the point cloud input to find a checkerboard.
More...
#include <checkerboard_finder.h>
This class processes the point cloud input to find a checkerboard.
Definition at line 38 of file checkerboard_finder.h.
robot_calibration::CheckerboardFinder::CheckerboardFinder |
( |
| ) |
|
void robot_calibration::CheckerboardFinder::cameraCallback |
( |
const sensor_msgs::PointCloud2 & |
cloud | ) |
|
|
private |
bool robot_calibration::CheckerboardFinder::find |
( |
robot_calibration_msgs::CalibrationData * |
msg | ) |
|
|
virtual |
Once the robot has been moved into the proper position and settled, this function will be called. It should add any new observations to the msg passed in.
- Parameters
-
msg | The message to which observations should be added. |
- Returns
- True if feature finder succeeded in finding the features and adding them to the observation list. False otherwise.
Implements robot_calibration::FeatureFinder.
Definition at line 112 of file checkerboard_finder.cpp.
bool robot_calibration::CheckerboardFinder::findInternal |
( |
robot_calibration_msgs::CalibrationData * |
msg | ) |
|
|
private |
bool robot_calibration::CheckerboardFinder::init |
( |
const std::string & |
name, |
|
|
ros::NodeHandle & |
nh |
|
) |
| |
|
virtual |
Initialize the feature finder.
- Parameters
-
name | The name of this finder. |
nh | The nodehandle to use when loading feature finder configuration data. |
- Returns
- True/False if the feature finder was able to be initialized
Reimplemented from robot_calibration::FeatureFinder.
Definition at line 39 of file checkerboard_finder.cpp.
bool robot_calibration::CheckerboardFinder::waitForCloud |
( |
| ) |
|
|
private |
std::string robot_calibration::CheckerboardFinder::camera_sensor_name_ |
|
private |
std::string robot_calibration::CheckerboardFinder::chain_sensor_name_ |
|
private |
sensor_msgs::PointCloud2 robot_calibration::CheckerboardFinder::cloud_ |
|
private |
std::string robot_calibration::CheckerboardFinder::frame_id_ |
|
private |
bool robot_calibration::CheckerboardFinder::output_debug_ |
|
private |
int robot_calibration::CheckerboardFinder::points_x_ |
|
private |
int robot_calibration::CheckerboardFinder::points_y_ |
|
private |
double robot_calibration::CheckerboardFinder::square_size_ |
|
private |
bool robot_calibration::CheckerboardFinder::waiting_ |
|
private |
The documentation for this class was generated from the following files: