#include <plane_finder.h>
Definition at line 30 of file plane_finder.h.
robot_calibration::PlaneFinder::PlaneFinder |
( |
| ) |
|
void robot_calibration::PlaneFinder::cameraCallback |
( |
const sensor_msgs::PointCloud2 & |
cloud | ) |
|
|
private |
bool robot_calibration::PlaneFinder::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 118 of file plane_finder.cpp.
bool robot_calibration::PlaneFinder::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 41 of file plane_finder.cpp.
bool robot_calibration::PlaneFinder::waitForCloud |
( |
| ) |
|
|
private |
std::string robot_calibration::PlaneFinder::camera_sensor_name_ |
|
private |
sensor_msgs::PointCloud2 robot_calibration::PlaneFinder::cloud_ |
|
private |
double robot_calibration::PlaneFinder::max_x_ |
|
private |
double robot_calibration::PlaneFinder::max_y_ |
|
private |
double robot_calibration::PlaneFinder::max_z_ |
|
private |
double robot_calibration::PlaneFinder::min_x_ |
|
private |
double robot_calibration::PlaneFinder::min_y_ |
|
private |
double robot_calibration::PlaneFinder::min_z_ |
|
private |
bool robot_calibration::PlaneFinder::output_debug_ |
|
private |
double robot_calibration::PlaneFinder::points_max_ |
|
private |
std::string robot_calibration::PlaneFinder::transform_frame_ |
|
private |
bool robot_calibration::PlaneFinder::waiting_ |
|
private |
The documentation for this class was generated from the following files: