#include "cloud_visualizer.h"
#include <tf2_ros/buffer.h>
#include <deque>
#include <boost/thread/mutex.hpp>
#include <nav_msgs/Path.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/TransformStamped.h>
#include <std_srvs/Empty.h>
#include <pcl_ros/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
Go to the source code of this file.
Classes | |
class | rc::CloudAccumulator |
Demonstration for how to create a registered point cloud map using the rc_visard. More... | |
Namespaces | |
rc | |
Macros | |
#define | PCL_NO_PRECOMPILE |
Typedefs | |
typedef pcl::PointXYZRGB | point_t |
typedef pcl::PointCloud< point_t > | pointcloud_t |
#define PCL_NO_PRECOMPILE |
Definition at line 1 of file cloud_accumulator.h.
typedef pcl::PointXYZRGB point_t |
Definition at line 14 of file cloud_accumulator.h.
typedef pcl::PointCloud<point_t> pointcloud_t |
Definition at line 15 of file cloud_accumulator.h.