Nodelet Algorithm Class. More...
#include <segment_plane_nodelet.h>
Public Member Functions | |
virtual void | onInit () |
Constructor. | |
Private Member Functions | |
pcl::PointCloud < pcl::PointXYZRGB >::Ptr | getBiggestPlane (pcl::PointCloud< pcl::PointXYZ >::Ptr clouda, pcl::PointCloud< pcl::PointXYZRGB >::Ptr cloud, pcl::PointCloud< pcl::PointXYZRGB >::Ptr cloud_rgb) |
get biggest plane coordinates | |
void | input_pointcloud_callback (const sensor_msgs::PointCloud2::ConstPtr &msg) |
void | pcCallback (const sensor_msgs::PointCloud2::ConstPtr &msg) |
pointcloud callback gets pointcloud publishes the segmented plane | |
Private Attributes | |
ros::Subscriber | input_pointcloud_subscriber_ |
sensor_msgs::PointCloud2 | PointCloud2_msg_ |
ros::Publisher | segmented_pointcloud_publisher_pointclouds_ |
int | table_segmentation_downsample |
double | table_segmentation_height |
double | table_segmentation_max_height |
double | table_segmentation_min_height |
Nodelet Algorithm Class.
Definition at line 46 of file segment_plane_nodelet.h.
pcl::PointCloud<pcl::PointXYZRGB>::Ptr iri_clean_board::SegmentPlane::getBiggestPlane | ( | pcl::PointCloud< pcl::PointXYZ >::Ptr | clouda, |
pcl::PointCloud< pcl::PointXYZRGB >::Ptr | cloud, | ||
pcl::PointCloud< pcl::PointXYZRGB >::Ptr | cloud_rgb | ||
) | [private] |
get biggest plane coordinates
Gets the biggest plane position
void iri_clean_board::SegmentPlane::input_pointcloud_callback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg | ) | [private] |
virtual void iri_clean_board::SegmentPlane::onInit | ( | ) | [virtual] |
Constructor.
This constructor initializes specific class attributes and all ROS communications variables to enable message exchange.
Implements nodelet::Nodelet.
void iri_clean_board::SegmentPlane::pcCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg | ) | [private] |
pointcloud callback gets pointcloud publishes the segmented plane
Definition at line 54 of file segment_plane_nodelet.h.
sensor_msgs::PointCloud2 iri_clean_board::SegmentPlane::PointCloud2_msg_ [private] |
Definition at line 51 of file segment_plane_nodelet.h.
Definition at line 50 of file segment_plane_nodelet.h.
Definition at line 66 of file segment_plane_nodelet.h.
double iri_clean_board::SegmentPlane::table_segmentation_height [private] |
Definition at line 69 of file segment_plane_nodelet.h.
double iri_clean_board::SegmentPlane::table_segmentation_max_height [private] |
Definition at line 68 of file segment_plane_nodelet.h.
double iri_clean_board::SegmentPlane::table_segmentation_min_height [private] |
Definition at line 67 of file segment_plane_nodelet.h.