#include <pluginlib/class_list_macros.h>#include "pcl_ros/io/bag_io.h"#include <pcl_ros/pcl_nodelet.h>#include <sensor_msgs/PointCloud2.h>#include <rosbag/bag.h>#include <rosbag/view.h>

Go to the source code of this file.
Typedefs | |
| typedef pcl_ros::BAGReader | BAGReader |
Functions | |
| PLUGINLIB_DECLARE_CLASS (pcl, BAGReader, BAGReader, nodelet::Nodelet) | |
| typedef pcl_ros::BAGReader BAGReader |
Definition at line 111 of file bag_io.cpp.