#include <pcl/keypoints/agast_2d.h>
#include <pcl/point_types.h>
#include <pcl/impl/instantiate.hpp>
Go to the source code of this file.
Namespaces | |
namespace | pcl |
namespace | pcl::keypoints |
namespace | pcl::keypoints::agast |
Functions | |
template<typename T1 , typename T2 > | |
int | pcl::keypoints::agast::AgastDetector5_8_computeCornerScore (const T1 *p, double im_bmax, double score_threshold, int_fast16_t s_offset0, int_fast16_t s_offset1, int_fast16_t s_offset2, int_fast16_t s_offset3, int_fast16_t s_offset4, int_fast16_t s_offset5, int_fast16_t s_offset6, int_fast16_t s_offset7) |
template<typename T1 , typename T2 > | |
void | pcl::keypoints::agast::AgastDetector5_8_detect (const T1 *im, int img_width, int img_height, double threshold, int_fast16_t s_offset0, int_fast16_t s_offset1, int_fast16_t s_offset2, int_fast16_t s_offset3, int_fast16_t s_offset4, int_fast16_t s_offset5, int_fast16_t s_offset6, int_fast16_t s_offset7, std::vector< pcl::PointUV, Eigen::aligned_allocator< pcl::PointUV > > &corners) |
template<typename T1 , typename T2 > | |
int | pcl::keypoints::agast::AgastDetector7_12s_computeCornerScore (const T1 *p, double im_bmax, double score_threshold, int_fast16_t s_offset0, int_fast16_t s_offset1, int_fast16_t s_offset2, int_fast16_t s_offset3, int_fast16_t s_offset4, int_fast16_t s_offset5, int_fast16_t s_offset6, int_fast16_t s_offset7, int_fast16_t s_offset8, int_fast16_t s_offset9, int_fast16_t s_offset10, int_fast16_t s_offset11) |
template<typename T1 , typename T2 > | |
void | pcl::keypoints::agast::AgastDetector7_12s_detect (const T1 *im, int img_width, int img_height, double threshold, int_fast16_t s_offset0, int_fast16_t s_offset1, int_fast16_t s_offset2, int_fast16_t s_offset3, int_fast16_t s_offset4, int_fast16_t s_offset5, int_fast16_t s_offset6, int_fast16_t s_offset7, int_fast16_t s_offset8, int_fast16_t s_offset9, int_fast16_t s_offset10, int_fast16_t s_offset11, std::vector< pcl::PointUV, Eigen::aligned_allocator< pcl::PointUV > > &corners) |
template<typename T1 , typename T2 > | |
int | pcl::keypoints::agast::OastDetector9_16_computeCornerScore (const T1 *p, double im_bmax, double score_threshold, int_fast16_t s_offset0, int_fast16_t s_offset1, int_fast16_t s_offset2, int_fast16_t s_offset3, int_fast16_t s_offset4, int_fast16_t s_offset5, int_fast16_t s_offset6, int_fast16_t s_offset7, int_fast16_t s_offset8, int_fast16_t s_offset9, int_fast16_t s_offset10, int_fast16_t s_offset11, int_fast16_t s_offset12, int_fast16_t s_offset13, int_fast16_t s_offset14, int_fast16_t s_offset15) |
template<typename T1 , typename T2 > | |
void | pcl::keypoints::agast::OastDetector9_16_detect (const T1 *im, int img_width, int img_height, double threshold, int_fast16_t s_offset0, int_fast16_t s_offset1, int_fast16_t s_offset2, int_fast16_t s_offset3, int_fast16_t s_offset4, int_fast16_t s_offset5, int_fast16_t s_offset6, int_fast16_t s_offset7, int_fast16_t s_offset8, int_fast16_t s_offset9, int_fast16_t s_offset10, int_fast16_t s_offset11, int_fast16_t s_offset12, int_fast16_t s_offset13, int_fast16_t s_offset14, int_fast16_t s_offset15, std::vector< pcl::PointUV, Eigen::aligned_allocator< pcl::PointUV > > &corners) |