38 #ifndef PCL_IO_CONCATENATE_FIELDS_H_ 39 #define PCL_IO_CONCATENATE_FIELDS_H_ 48 #include <sensor_msgs/PointCloud2.h> 97 std::map<ros::Time, std::vector<PointCloudConstPtr> >
queue_;
101 #endif //#ifndef PCL_IO_CONCATENATE_H_
ros::Subscriber sub_input_
The input PointCloud subscriber.
int maximum_queue_size_
The maximum number of messages that we can store in the queue.
PointCloudConcatenateFieldsSynchronizer(int queue_size)
Empty constructor.
std::map< ros::Time, std::vector< PointCloudConstPtr > > queue_
A queue for messages.
double maximum_seconds_
The maximum number of seconds to wait until we drop the synchronization.
PointCloudConcatenateFieldsSynchronizer()
Empty constructor.
int input_messages_
The number of input messages that we expect on the input topic.
PointCloudConcatenateFieldsSynchronizer is a special form of data synchronizer: it listens for a set ...
PointCloud::Ptr PointCloudPtr
virtual ~PointCloudConcatenateFieldsSynchronizer()
Empty destructor.
ros::Publisher pub_output_
The output PointCloud publisher.
sensor_msgs::PointCloud2 PointCloud
PointCloud::ConstPtr PointCloudConstPtr
void input_callback(const PointCloudConstPtr &cloud)