#include <mask_image_to_point_indices.h>

Public Member Functions | |
| MaskImageToPointIndices () | |
Protected Member Functions | |
| virtual void | indices (const sensor_msgs::Image::ConstPtr &image_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 mask_image_to_point_indices.h.
Definition at line 49 of file mask_image_to_point_indices.h.
| void jsk_pcl_ros_utils::MaskImageToPointIndices::indices | ( | const sensor_msgs::Image::ConstPtr & | image_msg | ) | [protected, virtual] |
Definition at line 75 of file mask_image_to_point_indices_nodelet.cpp.
| void jsk_pcl_ros_utils::MaskImageToPointIndices::onInit | ( | void | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 43 of file mask_image_to_point_indices_nodelet.cpp.
| void jsk_pcl_ros_utils::MaskImageToPointIndices::subscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 50 of file mask_image_to_point_indices_nodelet.cpp.
| void jsk_pcl_ros_utils::MaskImageToPointIndices::unsubscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 57 of file mask_image_to_point_indices_nodelet.cpp.
| void jsk_pcl_ros_utils::MaskImageToPointIndices::updateDiagnostic | ( | diagnostic_updater::DiagnosticStatusWrapper & | stat | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 62 of file mask_image_to_point_indices_nodelet.cpp.
Definition at line 66 of file mask_image_to_point_indices.h.
Definition at line 65 of file mask_image_to_point_indices.h.