#include <keypoints_publisher.h>

| Public Member Functions | |
| virtual void | onInit () | 
| Protected Member Functions | |
| virtual void | extractKeypoints (pcl::PointCloud< pcl::PointXYZ >::Ptr cloud) | 
| virtual void | inputCallback (const sensor_msgs::PointCloud2::ConstPtr &input) | 
| virtual void | subscribe () | 
| virtual void | unsubscribe () | 
| Protected Attributes | |
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | input_ | 
| std_msgs::Header | input_header_ | 
| ros::Publisher | keypoints_pub_ | 
| ros::Subscriber | sub_input_ | 
Definition at line 12 of file keypoints_publisher.h.
| void jsk_pcl_ros::KeypointsPublisher::extractKeypoints | ( | pcl::PointCloud< pcl::PointXYZ >::Ptr | cloud | ) |  [protected, virtual] | 
Definition at line 75 of file keypoints_publisher_nodelet.cpp.
| void jsk_pcl_ros::KeypointsPublisher::inputCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | input | ) |  [protected, virtual] | 
Definition at line 68 of file keypoints_publisher_nodelet.cpp.
| void jsk_pcl_ros::KeypointsPublisher::onInit | ( | void | ) |  [virtual] | 
Definition at line 48 of file keypoints_publisher_nodelet.cpp.
| void jsk_pcl_ros::KeypointsPublisher::subscribe | ( | ) |  [protected, virtual] | 
Definition at line 58 of file keypoints_publisher_nodelet.cpp.
| void jsk_pcl_ros::KeypointsPublisher::unsubscribe | ( | ) |  [protected, virtual] | 
Definition at line 63 of file keypoints_publisher_nodelet.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr jsk_pcl_ros::KeypointsPublisher::input_  [protected] | 
Definition at line 23 of file keypoints_publisher.h.
Definition at line 24 of file keypoints_publisher.h.
Definition at line 22 of file keypoints_publisher.h.
Definition at line 21 of file keypoints_publisher.h.