#include <string>
#include <ros/ros.h>
#include <sensor_msgs/PointCloud.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/point_cloud_conversion.h>
#include <visualization_msgs/Marker.h>
#include <tf/transform_listener.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_datatypes.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/io/io.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/filters/passthrough.h>
#include <pcl/filters/extract_indices.h>
#include <pcl/features/normal_3d.h>
#include <pcl/sample_consensus/method_types.h>
#include <pcl/sample_consensus/model_types.h>
#include <pcl/segmentation/sac_segmentation.h>
#include <pcl/filters/project_inliers.h>
#include <pcl/surface/convex_hull.h>
#include <pcl/search/kdtree.h>
#include <pcl/segmentation/extract_polygonal_prism_data.h>
#include <pcl/segmentation/extract_clusters.h>
#include <pcl_ros/transforms.h>
#include "tabletop_object_detector/marker_generator.h"
#include "tabletop_object_detector/TabletopSegmentation.h"
Go to the source code of this file.
Classes | |
class | tabletop_object_detector::TabletopSegmentor |
Namespaces | |
namespace | tabletop_object_detector |
Functions | |
template<typename PointT > | |
void | tabletop_object_detector::getClustersFromPointCloud2 (const pcl::PointCloud< PointT > &cloud_objects, const std::vector< pcl::PointIndices > &clusters2, std::vector< sensor_msgs::PointCloud > &clusters) |
template<typename PointT > | |
bool | tabletop_object_detector::getPlanePoints (const pcl::PointCloud< PointT > &table, const tf::Transform &table_plane_trans, sensor_msgs::PointCloud &table_points) |
tf::Transform | tabletop_object_detector::getPlaneTransform (pcl::ModelCoefficients coeffs, double up_direction, bool flatten_plane) |
int | main (int argc, char **argv) |
template<class PointCloudType > | |
void | tabletop_object_detector::straightenPoints (PointCloudType &points, const tf::Transform &table_plane_trans, const tf::Transform &table_plane_trans_flat) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 901 of file tabletop_segmentation.cpp.