#include <pcl/visualization/point_cloud_handlers.h>
#include <vector>
#include <boost/unordered_map.hpp>
#include <vtkLODActor.h>
#include <vtkSmartPointer.h>
#include <sensor_msgs/PointCloud2.h>
Go to the source code of this file.
Classes | |
class | pcl::visualization::CloudActor |
Namespaces | |
namespace | pcl |
namespace | pcl::visualization |
Typedefs | |
typedef boost::unordered_map < std::string, CloudActor > | pcl::visualization::CloudActorMap |
typedef boost::shared_ptr < CloudActorMap > | pcl::visualization::CloudActorMapPtr |
typedef std::map< int, vtkSmartPointer< vtkProp > > | pcl::visualization::CoordinateActorMap |
typedef boost::unordered_map < std::string, vtkSmartPointer < vtkProp > > | pcl::visualization::ShapeActorMap |
typedef boost::shared_ptr < ShapeActorMap > | pcl::visualization::ShapeActorMapPtr |