Public Member Functions | Private Member Functions | Private Attributes
robot_calibration::PlaneFinder Class Reference

#include <plane_finder.h>

Inheritance diagram for robot_calibration::PlaneFinder:
Inheritance graph
[legend]

List of all members.

Public Member Functions

bool find (robot_calibration_msgs::CalibrationData *msg)
 PlaneFinder (ros::NodeHandle &n)

Private Member Functions

void cameraCallback (const sensor_msgs::PointCloud2 &cloud)
bool waitForCloud ()

Private Attributes

std::string camera_sensor_name_
sensor_msgs::PointCloud2 cloud_
DepthCameraInfoManager depth_camera_manager_
double max_x_
double max_y_
double max_z_
double min_x_
double min_y_
double min_z_
double points_max_
ros::Publisher publisher_
ros::Subscriber subscriber_
std::string transform_frame_
bool waiting_

Detailed Description

Definition at line 29 of file plane_finder.h.


Constructor & Destructor Documentation

Definition at line 33 of file plane_finder.cpp.


Member Function Documentation

void robot_calibration::PlaneFinder::cameraCallback ( const sensor_msgs::PointCloud2 &  cloud) [private]

Definition at line 63 of file plane_finder.cpp.

bool robot_calibration::PlaneFinder::find ( robot_calibration_msgs::CalibrationData *  msg) [virtual]

Implements robot_calibration::FeatureFinder.

Definition at line 92 of file plane_finder.cpp.

Definition at line 72 of file plane_finder.cpp.


Member Data Documentation

Definition at line 47 of file plane_finder.h.

sensor_msgs::PointCloud2 robot_calibration::PlaneFinder::cloud_ [private]

Definition at line 44 of file plane_finder.h.

Definition at line 45 of file plane_finder.h.

Definition at line 50 of file plane_finder.h.

Definition at line 52 of file plane_finder.h.

Definition at line 54 of file plane_finder.h.

Definition at line 49 of file plane_finder.h.

Definition at line 51 of file plane_finder.h.

Definition at line 53 of file plane_finder.h.

Definition at line 48 of file plane_finder.h.

Definition at line 41 of file plane_finder.h.

Definition at line 40 of file plane_finder.h.

Definition at line 55 of file plane_finder.h.

Definition at line 43 of file plane_finder.h.


The documentation for this class was generated from the following files:


robot_calibration
Author(s): Michael Ferguson
autogenerated on Thu Jun 6 2019 21:54:10