, including all inherited members.
BaseClass typedef | pcl::Keypoint< PointInT, PointOutT > | |
compute(PointCloudOut &output) | pcl::Keypoint< PointInT, PointOutT > | [inline] |
computeSecondMomentMatrix(std::size_t pos, float *coefficients) const | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
ConstPtr typedef | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
deinitCompute() | pcl::PCLBase< PointInT > | [protected] |
derivatives_cols_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
derivatives_rows_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
detectKeypoints(PointCloudOut &output) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected, virtual] |
fake_indices_ | pcl::PCLBase< PointInT > | [protected] |
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] |
greaterIntensityAtIndices(int a, int b) const | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [inline, private] |
half_window_height_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
half_window_width_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
HARRIS enum value | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
HarrisKeypoint2D(ResponseMethod method=HARRIS, int window_width=3, int window_height=3, int min_distance=5, float threshold=0.0) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [inline] |
indices_ | pcl::PCLBase< PointInT > | [protected] |
initCompute() | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected, virtual] |
input_ | pcl::PCLBase< PointInT > | [protected] |
intensity_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
k_ | pcl::Keypoint< PointInT, PointOutT > | [protected] |
KdTree typedef | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
KdTreePtr typedef | pcl::Keypoint< PointInT, PointOutT > | |
Keypoint() | pcl::Keypoint< PointInT, PointOutT > | [inline] |
LOWE enum value | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
method_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
min_distance_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
name_ | pcl::Keypoint< PointInT, PointOutT > | [protected] |
NOBLE enum value | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
nonmax_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
operator[](size_t pos) | pcl::PCLBase< PointInT > | [inline] |
PCLBase() | pcl::PCLBase< PointInT > | |
PCLBase(const PCLBase &base) | pcl::PCLBase< PointInT > | |
PointCloud typedef | pcl::PCLBase< PointInT > | |
PointCloudConstPtr typedef | pcl::PCLBase< PointInT > | |
PointCloudIn typedef | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
PointCloudInConstPtr typedef | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
PointCloudInPtr typedef | pcl::Keypoint< PointInT, PointOutT > | |
PointCloudOut typedef | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
PointCloudPtr typedef | pcl::PCLBase< PointInT > | |
PointIndicesConstPtr typedef | pcl::PCLBase< PointInT > | |
PointIndicesPtr typedef | pcl::PCLBase< PointInT > | |
Ptr typedef | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
refine_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
response_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
responseHarris(PointCloudOut &output, float &highest_response) const | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
responseLowe(PointCloudOut &output, float &highest_response) const | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
ResponseMethod enum name | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
responseNoble(PointCloudOut &output, float &highest_response) const | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
responseTomasi(PointCloudOut &output, float &highest_response) const | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
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 typedef | pcl::Keypoint< PointInT, PointOutT > | |
SearchMethodSurface typedef | pcl::Keypoint< PointInT, PointOutT > | |
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] |
setKSearch(int k) | pcl::Keypoint< PointInT, PointOutT > | [inline] |
setMethod(ResponseMethod type) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
setMinimalDistance(int min_distance) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
setNonMaxSupression(bool=false) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
setNumberOfThreads(unsigned int nr_threads=0) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [inline] |
setRadiusSearch(double radius) | pcl::Keypoint< PointInT, PointOutT > | [inline] |
setRefine(bool do_refine) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
setSearchMethod(const KdTreePtr &tree) | pcl::Keypoint< PointInT, PointOutT > | [inline] |
setSearchSurface(const PointCloudInConstPtr &cloud) | pcl::Keypoint< PointInT, PointOutT > | [inline, virtual] |
setSkippedPixels(int skipped_pixels) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
setThreshold(float threshold) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
setWindowHeight(int window_height) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
setWindowWidth(int window_width) | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
skipped_pixels_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
surface_ | pcl::Keypoint< PointInT, PointOutT > | [protected] |
threads_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
threshold_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [protected] |
TOMASI enum value | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | |
tree_ | pcl::Keypoint< PointInT, PointOutT > | [protected] |
use_indices_ | pcl::PCLBase< PointInT > | [protected] |
window_height_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
window_width_ | pcl::HarrisKeypoint2D< PointInT, PointOutT, IntensityT > | [private] |
~Keypoint() | pcl::Keypoint< PointInT, PointOutT > | [inline, virtual] |
~PCLBase() | pcl::PCLBase< PointInT > | [inline, virtual] |