#include <decimated_publisher.h>
Public Member Functions | |
| DecimatedPublisher () | |
| virtual std::string | getTransportName () const |
| virtual | ~DecimatedPublisher () |
Protected Member Functions | |
| virtual void | publish (const sensor_msgs::PointCloud &pointcloud, const message_transport::SimplePublisherPlugin< sensor_msgs::PointCloud, sensor_msgs::PointCloud >::PublishFn &publish_fn) const |
Protected Attributes | |
| unsigned int | decimation |
Definition at line 8 of file decimated_publisher.h.
| decimated_transport::DecimatedPublisher::DecimatedPublisher | ( | ) | [inline] |
Definition at line 8 of file decimated_publisher.h.
| virtual decimated_transport::DecimatedPublisher::~DecimatedPublisher | ( | ) | [inline, virtual] |
Definition at line 9 of file decimated_publisher.h.
| virtual std::string decimated_transport::DecimatedPublisher::getTransportName | ( | ) | const [inline, virtual] |
Definition at line 11 of file decimated_publisher.h.
| void decimated_transport::DecimatedPublisher::publish | ( | const sensor_msgs::PointCloud & | pointcloud, | |
| const message_transport::SimplePublisherPlugin< sensor_msgs::PointCloud, sensor_msgs::PointCloud >::PublishFn & | publish_fn | |||
| ) | const [protected, virtual] |
Definition at line 4 of file decimated_publisher.cpp.
unsigned int decimated_transport::DecimatedPublisher::decimation [mutable, protected] |
Definition at line 20 of file decimated_publisher.h.