A NeighborhoodFeature descriptor is a generic descriptor uses a neighborhood of points to compute features. More...
#include <vector>
#include <Eigen3/Core>
#include <opencv/cv.h>
#include <opencv/cxcore.h>
#include <opencv/cvaux.hpp>
#include <sensor_msgs/PointCloud.h>
#include <point_cloud_mapping/geometry/nearest.h>
#include <point_cloud_mapping/kdtree/kdtree.h>
#include <ias_descriptors_3d/descriptor_3d.h>
Go to the source code of this file.
Classes | |
class | NeighborhoodFeature |
A NeighborhoodFeature is an abstract base class for descriptors that use a local neighborhood of points to compute features. More... |
A NeighborhoodFeature descriptor is a generic descriptor uses a neighborhood of points to compute features.
Definition in file neighborhood_feature.h.