#include <centroid_publisher.h>
Public Member Functions | |
CentroidPublisher () | |
Protected Member Functions | |
virtual void | extract (const sensor_msgs::PointCloud2ConstPtr &input) |
virtual void | onInit () |
virtual void | subscribe () |
virtual void | unsubscribe () |
Protected Attributes | |
tf::TransformBroadcaster | br_ |
std::string | frame_ |
ros::Publisher | pub_point_ |
ros::Publisher | pub_pose_ |
bool | publish_tf_ |
ros::Subscriber | sub_input_ |
Definition at line 55 of file centroid_publisher.h.
jsk_pcl_ros::CentroidPublisher::CentroidPublisher | ( | ) | [inline] |
Definition at line 58 of file centroid_publisher.h.
void jsk_pcl_ros::CentroidPublisher::extract | ( | const sensor_msgs::PointCloud2ConstPtr & | input | ) | [protected, virtual] |
Definition at line 46 of file centroid_publisher_nodelet.cpp.
void jsk_pcl_ros::CentroidPublisher::onInit | ( | void | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 84 of file centroid_publisher_nodelet.cpp.
void jsk_pcl_ros::CentroidPublisher::subscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 74 of file centroid_publisher_nodelet.cpp.
void jsk_pcl_ros::CentroidPublisher::unsubscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 79 of file centroid_publisher_nodelet.cpp.
Definition at line 66 of file centroid_publisher.h.
std::string jsk_pcl_ros::CentroidPublisher::frame_ [protected] |
Definition at line 67 of file centroid_publisher.h.
Definition at line 70 of file centroid_publisher.h.
Definition at line 69 of file centroid_publisher.h.
bool jsk_pcl_ros::CentroidPublisher::publish_tf_ [protected] |
Definition at line 68 of file centroid_publisher.h.
Definition at line 65 of file centroid_publisher.h.