The abstract base class for all feature descriptors that operate on 3-D data. More...
#include <vector>
#include <set>
#include <boost/shared_array.hpp>
#include <opencv/cxcore.h>
#include <opencv/cv.h>
#include <opencv/cvaux.hpp>
#include <ros/console.h>
#include <sensor_msgs/PointCloud.h>
#include <point_cloud_mapping/kdtree/kdtree.h>
Go to the source code of this file.
Classes | |
class | Descriptor3D |
Descriptor3D is the abstract base class for all descriptors that operate on 3-D data. All inheriting classes define all necessary parameters in their constructor. Hence, after instantiation, all descriptors can compute feature values through the compute() method. The number of feature values the descriptor generates on success is given by getResultSize() More... |
The abstract base class for all feature descriptors that operate on 3-D data.
Definition in file descriptor_3d.h.