17 #ifndef ROBOT_CALIBRATION_CAPTURE_PLANE_FINDER_H 18 #define ROBOT_CALIBRATION_CAPTURE_PLANE_FINDER_H 23 #include <robot_calibration_msgs/CalibrationData.h> 35 bool find(robot_calibration_msgs::CalibrationData * msg);
66 #endif // ROBOT_CALIBRATION_CAPTURE_PLANE_FINDER_H
std::string camera_sensor_name_
ros::Publisher publisher_
bool init(const std::string &name, ros::NodeHandle &n)
Initialize the feature finder.
Base class for a feature finder.
DepthCameraInfoManager depth_camera_manager_
std::string transform_frame_
sensor_msgs::PointCloud2 cloud_
bool find(robot_calibration_msgs::CalibrationData *msg)
Once the robot has been moved into the proper position and settled, this function will be called...
Calibration code lives under this namespace.
tf2_ros::Buffer tfBuffer_
Base class for a feature finder.
ros::Subscriber subscriber_
tf2_ros::TransformListener tfListener_
void cameraCallback(const sensor_msgs::PointCloud2 &cloud)