#include <fstream>
#include <pcl/point_types.h>
#include <pcl/io/pcd_io.h>
#include <pcl/features/vfh.h>
#include <pcl/features/normal_3d.h>
#include <pcl/apps/nn_classification.h>
#include <sensor_msgs/PointCloud2.h>
Go to the source code of this file.
Classes | |
class | pcl::VFHClassifierNN |
Utility class for nearest neighbor search based classification of VFH features. More... | |
Namespaces | |
namespace | pcl |
Functions | |
template<typename PointT > | |
pcl::PointCloud < pcl::VFHSignature308 >::Ptr | pcl::computeVFH (typename PointCloud< PointT >::ConstPtr cloud, double radius) |
Helper function to extract the VFH feature describing the given point cloud. |