, including all inherited members.
clearShared()=0 | Descriptor3D | [pure virtual] |
compute(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const geometry_msgs::Point32 * > &interest_pts, std::vector< std::vector< float > > &results) | Descriptor3D | |
compute(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const std::vector< int > * > &interest_region_indices, std::vector< std::vector< float > > &results) | Descriptor3D | |
computeAndConcatFeatures(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const geometry_msgs::Point32 * > &interest_pts, std::vector< Descriptor3D * > &descriptors_3d, std::vector< boost::shared_array< const float > > &concatenated_features) | Descriptor3D | [static] |
computeAndConcatFeatures(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const std::vector< int > * > &interest_region_indices, std::vector< Descriptor3D * > &descriptors_3d, std::vector< boost::shared_array< const float > > &concatenated_features) | Descriptor3D | [static] |
concatenateFeatures(const std::vector< std::vector< std::vector< float > > > &all_descriptor_results, const unsigned int nbr_samples, const unsigned int nbr_concatenated_vals, std::vector< boost::shared_array< const float > > &concatenated_features) | Descriptor3D | [private, static] |
debug_ | Descriptor3D | |
Descriptor3D() | Descriptor3D | |
doComputation(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const geometry_msgs::Point32 * > &interest_pts, std::vector< std::vector< float > > &results)=0 | Descriptor3D | [protected, pure virtual] |
doComputation(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const std::vector< int > * > &interest_region_indices, std::vector< std::vector< float > > &results)=0 | Descriptor3D | [protected, pure virtual] |
getName() const =0 | Descriptor3D | [pure virtual] |
getResultSize() const | Descriptor3D | [inline] |
precompute(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const geometry_msgs::Point32 * > &interest_pts)=0 | Descriptor3D | [protected, pure virtual] |
precompute(const sensor_msgs::PointCloud &data, cloud_kdtree::KdTree &data_kdtree, const std::vector< const std::vector< int > * > &interest_region_indices)=0 | Descriptor3D | [protected, pure virtual] |
result_size_ | Descriptor3D | [protected] |
result_size_defined_ | Descriptor3D | [protected] |
~Descriptor3D()=0 | Descriptor3D | [pure virtual] |