SimplePublisher publishes point clouds of type PointT. More...
#include <simple_publisher.h>
Public Types | |
| using | Cloud = pcl::PointCloud< PointT > |
| using | CloudConstPtr = typename Cloud::ConstPtr |
Public Member Functions | |
| void | run (double frequency=50.) |
| run the publisher; blocks until done More... | |
| SimplePublisher (ros::NodeHandle &nh, std::string topic, bool use_ros_time=false) | |
| void | slot (const CloudConstPtr &cloud) |
| void | stop () |
Private Attributes | |
| std::timed_mutex | cloud_publisher_mutex_ |
| ros::Publisher | publisher_ |
| bool | use_ros_time_ |
SimplePublisher publishes point clouds of type PointT.
Definition at line 22 of file simple_publisher.h.
| using SimplePublisher< PointT >::Cloud = pcl::PointCloud<PointT> |
Definition at line 25 of file simple_publisher.h.
| using SimplePublisher< PointT >::CloudConstPtr = typename Cloud::ConstPtr |
Definition at line 26 of file simple_publisher.h.
|
inline |
Definition at line 28 of file simple_publisher.h.
|
inline |
run the publisher; blocks until done
Definition at line 57 of file simple_publisher.h.
|
inline |
Definition at line 37 of file simple_publisher.h.
|
inline |
Definition at line 67 of file simple_publisher.h.
|
private |
Definition at line 73 of file simple_publisher.h.
|
private |
Definition at line 75 of file simple_publisher.h.
|
private |
Definition at line 74 of file simple_publisher.h.