#include <pointcloud_to_point_indices.h>
Public Member Functions | |
PointCloudToPointIndices () | |
Protected Member Functions | |
virtual void | convert (const sensor_msgs::PointCloud2::ConstPtr &point_msg) |
virtual void | onInit () |
virtual void | subscribe () |
virtual void | unsubscribe () |
Protected Attributes | |
ros::Publisher | pub_ |
ros::Subscriber | sub_ |
Definition at line 45 of file pointcloud_to_point_indices.h.
Definition at line 48 of file pointcloud_to_point_indices.h.
void jsk_pcl_ros_utils::PointCloudToPointIndices::convert | ( | const sensor_msgs::PointCloud2::ConstPtr & | point_msg | ) | [protected, virtual] |
Definition at line 60 of file pointcloud_to_point_indices_nodelet.cpp.
void jsk_pcl_ros_utils::PointCloudToPointIndices::onInit | ( | void | ) | [protected, virtual] |
Definition at line 43 of file pointcloud_to_point_indices_nodelet.cpp.
void jsk_pcl_ros_utils::PointCloudToPointIndices::subscribe | ( | ) | [protected, virtual] |
Definition at line 50 of file pointcloud_to_point_indices_nodelet.cpp.
void jsk_pcl_ros_utils::PointCloudToPointIndices::unsubscribe | ( | ) | [protected, virtual] |
Definition at line 55 of file pointcloud_to_point_indices_nodelet.cpp.
Definition at line 62 of file pointcloud_to_point_indices.h.
Definition at line 61 of file pointcloud_to_point_indices.h.