#include <ros/node_handle.h>
#include <sensor_msgs/PointCloud.h>
#include <point_cloud_mapping/cloud_io.h>
#include <tf/transform_broadcaster.h>
#include <boost/filesystem/operations.hpp>
#include <boost/filesystem/fstream.hpp>
#include "boost/filesystem.hpp"
Go to the source code of this file.
Classes | |
class | MultiPCDGenerator |
Functions | |
int | main (int argc, char **argv) |
Definition at line 151 of file multi_pcd_to_msg.cpp.