#include <organized_pointcloud_to_point_indices.h>
Public Member Functions | |
OrganizedPointCloudToPointIndices () | |
Protected Member Functions | |
virtual void | indices (const sensor_msgs::PointCloud2::ConstPtr &point_msg) |
virtual void | onInit () |
virtual void | subscribe () |
virtual void | unsubscribe () |
virtual void | updateDiagnostic (diagnostic_updater::DiagnosticStatusWrapper &stat) |
Protected Attributes | |
ros::Publisher | pub_ |
ros::Subscriber | sub_ |
Definition at line 46 of file organized_pointcloud_to_point_indices.h.
Definition at line 49 of file organized_pointcloud_to_point_indices.h.
void jsk_pcl_ros::OrganizedPointCloudToPointIndices::indices | ( | const sensor_msgs::PointCloud2::ConstPtr & | point_msg | ) | [protected, virtual] |
Definition at line 74 of file organized_pointcloud_to_point_indices_nodelet.cpp.
void jsk_pcl_ros::OrganizedPointCloudToPointIndices::onInit | ( | void | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 43 of file organized_pointcloud_to_point_indices_nodelet.cpp.
void jsk_pcl_ros::OrganizedPointCloudToPointIndices::subscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 49 of file organized_pointcloud_to_point_indices_nodelet.cpp.
void jsk_pcl_ros::OrganizedPointCloudToPointIndices::unsubscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 56 of file organized_pointcloud_to_point_indices_nodelet.cpp.
void jsk_pcl_ros::OrganizedPointCloudToPointIndices::updateDiagnostic | ( | diagnostic_updater::DiagnosticStatusWrapper & | stat | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 61 of file organized_pointcloud_to_point_indices_nodelet.cpp.
Definition at line 66 of file organized_pointcloud_to_point_indices.h.
Definition at line 65 of file organized_pointcloud_to_point_indices.h.