all_descriptors.h [code] | |
bounding_box_raw.cpp [code] | |
bounding_box_raw.h [code] | A BoundingBoxRaw descriptor computes the dimensions of the 3-D box that encloses a group of points in given xyz space |
bounding_box_spectral.cpp [code] | |
bounding_box_spectral.h [code] | A BoundingBoxSpectral descriptor computes the dimensions of the 3-D box that encloses a group of points in the neighborhood's principle component space |
channel.cpp [code] | |
channel.h [code] | A Channel descriptor uses the value in a specified channel name of a sensor_msgs::PointCloud for the feature |
curvature.cpp [code] | |
curvature.h [code] | A Curvature descriptor computes the local curvature |
descriptor_3d.cpp [code] | |
descriptor_3d.h [code] | The abstract base class for all feature descriptors that operate on 3-D data |
interest_point_example.cpp [code] | |
neighborhood_feature.cpp [code] | |
neighborhood_feature.h [code] | A NeighborhoodFeature descriptor is a generic descriptor uses a neighborhood of points to compute features |
orientation_generic.cpp [code] | |
orientation_generic.h [code] | An OrientationGeneric descriptor computes the angle between a local direction (data dependent) and a specified reference direction |
orientation_normal.cpp [code] | |
orientation_normal.h [code] | An Orientation descriptor using locally extracted normals as the local direction |
orientation_tangent.cpp [code] | |
orientation_tangent.h [code] | An OrientationTangent descriptor using locally extracted tangents as the local direction |
position.cpp [code] | |
position.h [code] | A Position descriptor uses the 3rd coordinate (z/elevation) of the interest point/region |
shape_spectral.cpp [code] | |
shape_spectral.h [code] | A ShapeSpectral descriptor computes features that describe the local shape of a neighborhood of points |
spectral_analysis.cpp [code] | |
spectral_analysis.h [code] | An auxiliary class used by descriptors that require the results from spectral analysis of a given volume of points |
spin_image_custom.cpp [code] | |
spin_image_custom.h [code] | A spin image descriptor with custom spinning axis |
spin_image_generic.cpp [code] | |
spin_image_generic.h [code] | A SpinImageGeneric descriptor is the base abstract class for computing the feature described in: Johnson and Hebert, "Using Spin-Images for Efficient Object Recognition in Cluttered 3-D Scenes", PAMI 1999 |
spin_image_normal.cpp [code] | |
spin_image_normal.h [code] | A spin image descriptor using local normal as the spinning axis |
spin_image_tangent.cpp [code] | |
spin_image_tangent.h [code] | A spin image descriptor using local tangent as the spinning axis |