#include "parameter_server.h"
#include "pcl/ros/conversions.h"
#include <pcl/io/io.h>
#include "pcl_ros/transforms.h"
#include "bagloader.h"
#include <iostream>
#include <sstream>
#include <string>
#include <sensor_msgs/PointCloud2.h>
#include <Eigen/Core>
#include "misc.h"
#include <rosbag/view.h>
#include <boost/foreach.hpp>
#include "scoped_timer.h"
#include <tf/transform_listener.h>
Go to the source code of this file.
Typedefs | |
typedef message_filters::Subscriber < sensor_msgs::PointCloud2 > | pc_sub_type |
typedef message_filters::Subscriber<sensor_msgs::PointCloud2> pc_sub_type |
Definition at line 44 of file bagloader.cpp.