Classes | |
| class | ObjectButtonDetector |
| class | SurfaceSegmentation |
| class | TableApproaches |
| class | TabletopDetector |
| class | TabletopSegmentor |
| class | TestNormals |
Typedefs | |
| typedef pcl::PointXYZRGB | PRGB |
| typedef pcl::PointXYZRGBNormal | PRGBN |
Functions | |
| bool | compind (uint32_t a, uint32_t b, vector< float > v) |
| void | convCvBox2DPoly (CvBox2D &box, CvPoint **&pts, int *&npts) |
| void | drawCvBox2D (IplImage &img, CvBox2D &box, cv::Scalar color, int width=1) |
| void | fillCvBox2D (IplImage &img, CvBox2D &box, cv::Scalar color) |
| bool | pose_dist_comp (geometry_msgs::Pose &p1, geometry_msgs::Pose &p2, geometry_msgs::Point &app_pt) |
| bool | pose_dist_thresh (geometry_msgs::Pose pose, geometry_msgs::Point pt, double thresh) |
| typedef pcl::PointXYZRGB hrl_table_detect::PRGB |
Definition at line 49 of file surface_segmentation.cpp.
| typedef pcl::PointXYZRGBNormal hrl_table_detect::PRGBN |
Definition at line 50 of file surface_segmentation.cpp.
| bool hrl_table_detect::compind | ( | uint32_t | a, |
| uint32_t | b, | ||
| vector< float > | v | ||
| ) |
Definition at line 90 of file tabletop_detector.cpp.
| void hrl_table_detect::convCvBox2DPoly | ( | CvBox2D & | box, |
| CvPoint **& | pts, | ||
| int *& | npts | ||
| ) |
Definition at line 92 of file tabletop_detector.cpp.
| void hrl_table_detect::drawCvBox2D | ( | IplImage & | img, |
| CvBox2D & | box, | ||
| cv::Scalar | color, | ||
| int | width = 1 |
||
| ) |
Definition at line 105 of file tabletop_detector.cpp.
| void hrl_table_detect::fillCvBox2D | ( | IplImage & | img, |
| CvBox2D & | box, | ||
| cv::Scalar | color | ||
| ) |
Definition at line 112 of file tabletop_detector.cpp.
| bool hrl_table_detect::pose_dist_comp | ( | geometry_msgs::Pose & | p1, |
| geometry_msgs::Pose & | p2, | ||
| geometry_msgs::Point & | app_pt | ||
| ) |
Definition at line 97 of file table_approaches.cpp.
| bool hrl_table_detect::pose_dist_thresh | ( | geometry_msgs::Pose | pose, |
| geometry_msgs::Point | pt, | ||
| double | thresh | ||
| ) |
Definition at line 101 of file table_approaches.cpp.