$search
table_object_detector detects tables and objects.
Definition at line 81 of file table_object_detector.cpp.
typedef pcl::KdTree<Point>::Ptr TableObjectDetector::KdTreePtr [private] |
Definition at line 84 of file table_object_detector.cpp.
typedef pcl::PointXYZRGB TableObjectDetector::Point [private] |
Definition at line 83 of file table_object_detector.cpp.
TableObjectDetector::TableObjectDetector | ( | ) | [inline] |
Definition at line 135 of file table_object_detector.cpp.
void TableObjectDetector::input_callback | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud2_in | ) | [inline] |
Definition at line 220 of file table_object_detector.cpp.
pcl::PointCloud<Point>::ConstPtr TableObjectDetector::cloud_ |
Definition at line 118 of file table_object_detector.cpp.
Definition at line 120 of file table_object_detector.cpp.
Definition at line 120 of file table_object_detector.cpp.
pcl::PointCloud<pcl::Normal>::ConstPtr TableObjectDetector::cloud_normals_ |
Definition at line 122 of file table_object_detector.cpp.
Definition at line 132 of file table_object_detector.cpp.
Definition at line 132 of file table_object_detector.cpp.
Definition at line 90 of file table_object_detector.cpp.
Definition at line 89 of file table_object_detector.cpp.
pcl::EuclideanClusterExtraction<Point> TableObjectDetector::cluster_ |
Definition at line 101 of file table_object_detector.cpp.
Definition at line 93 of file table_object_detector.cpp.
Definition at line 105 of file table_object_detector.cpp.
Definition at line 105 of file table_object_detector.cpp.
pcl::VoxelGrid<Point> TableObjectDetector::grid_ |
Definition at line 95 of file table_object_detector.cpp.
pcl::VoxelGrid<Point> TableObjectDetector::grid_objects_ |
Definition at line 95 of file table_object_detector.cpp.
pcl::ConvexHull<Point> TableObjectDetector::hull_ |
Definition at line 99 of file table_object_detector.cpp.
Definition at line 106 of file table_object_detector.cpp.
Definition at line 107 of file table_object_detector.cpp.
Definition at line 107 of file table_object_detector.cpp.
pcl::NormalEstimation<Point, pcl::Normal> TableObjectDetector::n3d_ |
Definition at line 96 of file table_object_detector.cpp.
Definition at line 87 of file table_object_detector.cpp.
Definition at line 109 of file table_object_detector.cpp.
Definition at line 93 of file table_object_detector.cpp.
Definition at line 115 of file table_object_detector.cpp.
Definition at line 115 of file table_object_detector.cpp.
Definition at line 112 of file table_object_detector.cpp.
Definition at line 112 of file table_object_detector.cpp.
pcl::PassThrough<Point> TableObjectDetector::pass_ |
Definition at line 94 of file table_object_detector.cpp.
pcl::ExtractPolygonalPrismData<Point> TableObjectDetector::prism_ |
Definition at line 100 of file table_object_detector.cpp.
pcl::ProjectInliers<Point> TableObjectDetector::proj_ |
Definition at line 98 of file table_object_detector.cpp.
Definition at line 108 of file table_object_detector.cpp.
pcl::SACSegmentationFromNormals<Point, pcl::Normal> TableObjectDetector::seg_ |
Definition at line 97 of file table_object_detector.cpp.
Definition at line 126 of file table_object_detector.cpp.
pcl::PointCloud<Point>::ConstPtr TableObjectDetector::table_hull_ |
Definition at line 130 of file table_object_detector.cpp.
Definition at line 124 of file table_object_detector.cpp.
Definition at line 128 of file table_object_detector.cpp.