#include "typedefs.h"
#include <pcl/ModelCoefficients.h>
#include <pcl/sample_consensus/method_types.h>
#include <pcl/sample_consensus/model_types.h>
#include <pcl/segmentation/sac_segmentation.h>
#include <pcl/filters/extract_indices.h>
#include <pcl/segmentation/extract_clusters.h>
Go to the source code of this file.
Functions | |
void | clusterObjects (const PointCloudPtr &input, float cluster_tolerance, int min_cluster_size, int max_cluster_size, std::vector< pcl::PointIndices > &cluster_indices_out) |
PointCloudPtr | findAndSubtractPlane (const PointCloudPtr &input, float distance_threshold, float max_iterations) |
pcl::ModelCoefficients::Ptr | fitPlane (const PointCloudPtr &input, float distance_threshold, float max_iterations) |
void clusterObjects | ( | const PointCloudPtr & | input, |
float | cluster_tolerance, | ||
int | min_cluster_size, | ||
int | max_cluster_size, | ||
std::vector< pcl::PointIndices > & | cluster_indices_out | ||
) |
Definition at line 62 of file iros2011/include/segmentation.h.
PointCloudPtr findAndSubtractPlane | ( | const PointCloudPtr & | input, |
float | distance_threshold, | ||
float | max_iterations | ||
) |
Definition at line 45 of file iros2011/include/segmentation.h.
pcl::ModelCoefficients::Ptr fitPlane | ( | const PointCloudPtr & | input, |
float | distance_threshold, | ||
float | max_iterations | ||
) |
Definition at line 27 of file iros2011/include/segmentation.h.