#include <Eigen/StdVector>
#include <vector>
#include "pcl/ros_macros.h"
#include <boost/shared_ptr.hpp>
#include <boost/make_shared.hpp>
#include <sensor_msgs/PointCloud2.h>
#include "pcl/point_cloud.h"
#include "pcl/PointIndices.h"
#include "pcl/win32_macros.h"
Go to the source code of this file.
Classes | |
class | pcl::PCLBase< PointT > |
PCL base class. Implements methods that are used by all PCL objects. More... | |
class | pcl::PCLBase< sensor_msgs::PointCloud2 > |
Namespaces | |
namespace | pcl |
Typedefs | |
typedef boost::shared_ptr < const std::vector< int > > | pcl::IndicesConstPtr |
typedef boost::shared_ptr < std::vector< int > > | pcl::IndicesPtr |