Go to the documentation of this file.
38 #ifndef PCL_ROS_IO_BAG_IO_H_
39 #define PCL_ROS_IO_BAG_IO_H_
43 #include <sensor_msgs/PointCloud2.h>
79 output_ =
it_->instantiate<sensor_msgs::PointCloud2> ();
89 bool open (
const std::string &file_name,
const std::string &topic_name);
126 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
131 #endif //#ifndef PCL_ROS_IO_BAG_IO_H_
PointCloudConstPtr getNextCloud()
Get the next point cloud dataset in the BAG file.
PointCloud::ConstPtr PointCloudConstPtr
PointCloud::ConstPtr PointCloudConstPtr
BAGReader()
Empty constructor.
sensor_msgs::PointCloud2 PointCloud
PointCloudPtr output_
The output point cloud dataset containing the points loaded from the file.
BAG PointCloud file format reader.
virtual void onInit()
Nodelet initialization routine.
rosbag::View view_
The BAG view object.
std::string topic_name_
The name of the topic that contains the PointCloud data.
void close()
Close an open BAG file.
PointCloud::Ptr PointCloudPtr
double publish_rate_
The publishing interval in seconds. Set to 0 to publish once (default).
rosbag::View::iterator it_
The BAG view iterator object.
void setPublishRate(double publish_rate)
Set the publishing rate in seconds.
std::string file_name_
The name of the BAG file that contains the PointCloud data.
bool open(const std::string &file_name, const std::string &topic_name)
Open a BAG file for reading and select a specified topic.
rosbag::Bag bag_
The BAG object.
double getPublishRate()
Get the publishing rate in seconds.
pcl_ros
Author(s): Open Perception, Julius Kammerl
, William Woodall
autogenerated on Fri Jul 12 2024 02:54:40