Nodelet Algorithm Class. More...
#include <pointcloud_to_image_nodelet.h>

Public Member Functions | |
| virtual void | onInit () |
| Constructor. | |
Private Member Functions | |
| sensor_msgs::ImagePtr | cvimage_to_rosimage (cv::Mat cvimage) |
| Puts a image in a ros msg. | |
| 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 | |
| cv::Mat | pointcloud_to_image (pcl::PointCloud< pcl::PointXYZRGB >::Ptr cloud) |
| Gets image from the pointcloud. | |
Private Attributes | |
| sensor_msgs::ImagePtr | Image_msg_ |
| ros::Subscriber | input_pointcloud_subscriber_ |
| ros::Publisher | segmented_pointcloud_publisher_images_ |
Nodelet Algorithm Class.
Definition at line 37 of file pointcloud_to_image_nodelet.h.
| sensor_msgs::ImagePtr iri_clean_board::PointcloudToImage::cvimage_to_rosimage | ( | cv::Mat | cvimage | ) | [private] |
Puts a image in a ros msg.
image to a ros msg
| void iri_clean_board::PointcloudToImage::input_pointcloud_callback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg | ) | [private] |
| virtual void iri_clean_board::PointcloudToImage::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::PointcloudToImage::pcCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg | ) | [private] |
pointcloud callback gets pointcloud publishes the segmented plane
| cv::Mat iri_clean_board::PointcloudToImage::pointcloud_to_image | ( | pcl::PointCloud< pcl::PointXYZRGB >::Ptr | cloud | ) | [private] |
Gets image from the pointcloud.
Gets image from the pointcloud
sensor_msgs::ImagePtr iri_clean_board::PointcloudToImage::Image_msg_ [private] |
Definition at line 41 of file pointcloud_to_image_nodelet.h.
Definition at line 45 of file pointcloud_to_image_nodelet.h.
Definition at line 42 of file pointcloud_to_image_nodelet.h.