pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > Member List
This is the complete list of members for pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >, including all inherited members.
angular_threshold_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
BaseClass typedefpcl::Keypoint< PointInT, PointOutT >
compute(PointCloudOut &output)pcl::Keypoint< PointInT, PointOutT > [inline]
ConstPtr typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
deinitCompute()pcl::PCLBase< PointInT > [protected]
detectKeypoints(PointCloudOut &output)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [protected, virtual]
distance_threshold_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
fake_indices_pcl::PCLBase< PointInT > [protected]
geometric_validation_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
getClassName() const pcl::Keypoint< PointInT, PointOutT > [inline, protected]
getIndices()pcl::PCLBase< PointInT > [inline]
getInputCloud()pcl::PCLBase< PointInT > [inline]
getKSearch()pcl::Keypoint< PointInT, PointOutT > [inline]
getRadiusSearch()pcl::Keypoint< PointInT, PointOutT > [inline]
getSearchMethod()pcl::Keypoint< PointInT, PointOutT > [inline]
getSearchParameter()pcl::Keypoint< PointInT, PointOutT > [inline]
getSearchSurface()pcl::Keypoint< PointInT, PointOutT > [inline]
indices_pcl::PCLBase< PointInT > [protected]
initCompute()pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [protected, virtual]
input_pcl::PCLBase< PointInT > [protected]
intensity_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
intensity_out_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
intensity_threshold_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
isWithinNucleusCentroid(const Eigen::Vector3f &nucleus, const Eigen::Vector3f &centroid, const Eigen::Vector3f &nc, const PointInT &point) const pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [protected]
k_pcl::Keypoint< PointInT, PointOutT > [protected]
KdTree typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
KdTreePtr typedefpcl::Keypoint< PointInT, PointOutT >
Keypoint()pcl::Keypoint< PointInT, PointOutT > [inline]
label_idx_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
name_pcl::Keypoint< PointInT, PointOutT > [protected]
nonmax_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
normals_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
operator[](size_t pos)pcl::PCLBase< PointInT > [inline]
out_fields_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
PCLBase()pcl::PCLBase< PointInT >
PCLBase(const PCLBase &base)pcl::PCLBase< PointInT >
PointCloud typedefpcl::PCLBase< PointInT >
PointCloudConstPtr typedefpcl::PCLBase< PointInT >
PointCloudIn typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
PointCloudInConstPtr typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
PointCloudInPtr typedefpcl::Keypoint< PointInT, PointOutT >
PointCloudN typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
PointCloudNConstPtr typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
PointCloudNPtr typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
PointCloudOut typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
PointCloudPtr typedefpcl::PCLBase< PointInT >
PointIndicesConstPtr typedefpcl::PCLBase< PointInT >
PointIndicesPtr typedefpcl::PCLBase< PointInT >
Ptr typedefpcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
search_method_pcl::Keypoint< PointInT, PointOutT > [protected]
search_method_surface_pcl::Keypoint< PointInT, PointOutT > [protected]
search_parameter_pcl::Keypoint< PointInT, PointOutT > [protected]
search_radius_pcl::Keypoint< PointInT, PointOutT > [protected]
searchForNeighbors(int index, double parameter, std::vector< int > &indices, std::vector< float > &distances) const pcl::Keypoint< PointInT, PointOutT > [inline]
SearchMethod typedefpcl::Keypoint< PointInT, PointOutT >
SearchMethodSurface typedefpcl::Keypoint< PointInT, PointOutT >
setAngularThreshold(float angular_threshold)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setDistanceThreshold(float distance_threshold)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setGeometricValidation(bool validate)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setIndices(const IndicesPtr &indices)pcl::PCLBase< PointInT > [virtual]
setIndices(const IndicesConstPtr &indices)pcl::PCLBase< PointInT > [virtual]
setIndices(const PointIndicesConstPtr &indices)pcl::PCLBase< PointInT > [virtual]
setIndices(size_t row_start, size_t col_start, size_t nb_rows, size_t nb_cols)pcl::PCLBase< PointInT > [virtual]
setInputCloud(const PointCloudConstPtr &cloud)pcl::PCLBase< PointInT > [virtual]
setIntensityThreshold(float intensity_threshold)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setKSearch(int k)pcl::Keypoint< PointInT, PointOutT > [inline]
setNonMaxSupression(bool nonmax)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setNormals(const PointCloudNConstPtr &normals)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setNumberOfThreads(unsigned int nr_threads)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setRadius(float radius)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT >
setRadiusSearch(double radius)pcl::Keypoint< PointInT, PointOutT > [inline]
setSearchMethod(const KdTreePtr &tree)pcl::Keypoint< PointInT, PointOutT > [inline]
setSearchSurface(const PointCloudInConstPtr &cloud)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [virtual]
pcl::Keypoint::setSearchSurface(const PointCloudInConstPtr &cloud)pcl::Keypoint< PointInT, PointOutT > [inline, virtual]
surface_pcl::Keypoint< PointInT, PointOutT > [protected]
SUSANKeypoint(float radius=0.01f, float distance_threshold=0.001f, float angular_threshold=0.0001f, float intensity_threshold=7.0f)pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [inline]
threads_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
tolerance_pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [private]
tree_pcl::Keypoint< PointInT, PointOutT > [protected]
use_indices_pcl::PCLBase< PointInT > [protected]
~Keypoint()pcl::Keypoint< PointInT, PointOutT > [inline, virtual]
~PCLBase()pcl::PCLBase< PointInT > [inline, virtual]
~SUSANKeypoint()pcl::SUSANKeypoint< PointInT, PointOutT, NormalT, IntensityT > [inline, virtual]


pcl
Author(s): Open Perception
autogenerated on Wed Aug 26 2015 15:43:37