
Go to the source code of this file.
Namespaces | |
| namespace | cloud_geometry |
| namespace | cloud_geometry::statistics |
Functions | |
| geometry_msgs::Point32 | cloud_geometry::statistics::computeMedian (const sensor_msgs::PointCloud &points) |
| Compute the median value of a 3D point cloud and return it as a Point32. | |
| geometry_msgs::Point32 | cloud_geometry::statistics::computeMedian (const sensor_msgs::PointCloud &points, const std::vector< int > &indices) |
| Compute the median value of a 3D point cloud using a given set point indices and return it as a Point32. | |
| double | cloud_geometry::statistics::computeMedianAbsoluteDeviation (const sensor_msgs::PointCloud &points, double sigma) |
| Compute the median absolute deviation:
| |
| double | cloud_geometry::statistics::computeMedianAbsoluteDeviation (const sensor_msgs::PointCloud &points, const std::vector< int > &indices, double sigma) |
| Compute the median absolute deviation:
| |
| void | cloud_geometry::statistics::getChannelMeanStd (const sensor_msgs::PointCloud &points, int d_idx, double &mean, double &stddev) |
| Compute both the mean and the standard deviation of a channel/dimension of the cloud. | |
| void | cloud_geometry::statistics::getChannelMeanStd (const sensor_msgs::PointCloud &points, const std::vector< int > &indices, int d_idx, double &mean, double &stddev) |
| Compute both the mean and the standard deviation of a channel/dimension of the cloud using indices. | |
| void | cloud_geometry::statistics::getTrimean (std::vector< int > values, double &trimean) |
| Compute both the trimean (a statistical resistent L-Estimate) of an array of values. | |
| void | cloud_geometry::statistics::selectPointsInsideDistribution (const sensor_msgs::PointCloud &points, const std::vector< int > &indices, int d_idx, double mean, double stddev, double alpha, std::vector< int > &inliers) |
| Determines a set of point indices inside of a +/- * distribution interval, in a given channel space, where and are the mean and the standard deviation of the channel distribution. | |
| void | cloud_geometry::statistics::selectPointsOutsideDistribution (const sensor_msgs::PointCloud &points, const std::vector< int > &indices, int d_idx, double mean, double stddev, double alpha, std::vector< int > &inliers) |
| Determines a set of point indices outside of a +/- * distribution interval, in a given channel space, where and are the mean and the standard deviation of the channel distribution. | |