Go to the documentation of this file.
38 #ifndef PCL_IO_CONCATENATE_FIELDS_H_
39 #define PCL_IO_CONCATENATE_FIELDS_H_
44 #include <sensor_msgs/PointCloud2.h>
93 std::map<ros::Time, std::vector<PointCloudConstPtr> >
queue_;
97 #endif //#ifndef PCL_IO_CONCATENATE_H_
PointCloud::ConstPtr PointCloudConstPtr
PointCloud::Ptr PointCloudPtr
PointCloudConcatenateFieldsSynchronizer(int queue_size)
Empty constructor.
ros::Subscriber sub_input_
The input PointCloud subscriber.
sensor_msgs::PointCloud2 PointCloud
std::map< ros::Time, std::vector< PointCloudConstPtr > > queue_
A queue for messages.
void input_callback(const PointCloudConstPtr &cloud)
int input_messages_
The number of input messages that we expect on the input topic.
PointCloud::ConstPtr PointCloudConstPtr
ros::Publisher pub_output_
The output PointCloud publisher.
double maximum_seconds_
The maximum number of seconds to wait until we drop the synchronization.
int maximum_queue_size_
The maximum number of messages that we can store in the queue.
PointCloudConcatenateFieldsSynchronizer is a special form of data synchronizer: it listens for a set ...
virtual ~PointCloudConcatenateFieldsSynchronizer()
Empty destructor.
PointCloudConcatenateFieldsSynchronizer()
Empty constructor.
pcl_ros
Author(s): Open Perception, Julius Kammerl
, William Woodall
autogenerated on Fri Jul 12 2024 02:54:40