Class ProjectInliers

Inheritance Relationships

Base Type

Class Documentation

class ProjectInliers : public pcl_ros::Filter

ProjectInliers uses a model and a set of inlier indices from a PointCloud to project them into a separate PointCloud.

Author

Radu Bogdan Rusu

Note

setFilterFieldName (), setFilterLimits (), and setFilterLimitNegative () are ignored.

Public Functions

explicit ProjectInliers(const rclcpp::NodeOptions &options)

Protected Functions

inline virtual void filter(const PointCloud2::ConstSharedPtr &input, const IndicesPtr &indices, PointCloud2 &output) override

Call the actual filter.

Parameters:
  • input – the input point cloud dataset

  • indices – the input set of indices to use from input

  • output – the resultant filtered dataset