#include <pointcloud_xyz_to_xyzrgb.h>
Public Member Functions | |
PointCloudXYZToXYZRGB () | |
Protected Member Functions | |
virtual void | convert (const sensor_msgs::PointCloud2::ConstPtr &cloud_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_xyz_to_xyzrgb.h.
Definition at line 48 of file pointcloud_xyz_to_xyzrgb.h.
void jsk_pcl_ros_utils::PointCloudXYZToXYZRGB::convert | ( | const sensor_msgs::PointCloud2::ConstPtr & | cloud_msg | ) | [protected, virtual] |
Definition at line 62 of file pointcloud_xyz_to_xyzrgb_nodelet.cpp.
void jsk_pcl_ros_utils::PointCloudXYZToXYZRGB::onInit | ( | void | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 45 of file pointcloud_xyz_to_xyzrgb_nodelet.cpp.
void jsk_pcl_ros_utils::PointCloudXYZToXYZRGB::subscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 52 of file pointcloud_xyz_to_xyzrgb_nodelet.cpp.
void jsk_pcl_ros_utils::PointCloudXYZToXYZRGB::unsubscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 57 of file pointcloud_xyz_to_xyzrgb_nodelet.cpp.
Definition at line 56 of file pointcloud_xyz_to_xyzrgb.h.
Definition at line 55 of file pointcloud_xyz_to_xyzrgb.h.