Class StaticLaserScanPolygonFilter

Inheritance Relationships

Base Type

Class Documentation

class StaticLaserScanPolygonFilter : public laser_filters::LaserScanPolygonFilterBase

This is a filter that removes points in a laser scan inside of a polygon. It assumes that the transform between the scanner and the robot base remains unchanged, i.e. the position and orientation of the laser filter should not change. A typical use case for this filter is to filter out parts of the robot body or load that it may carry.

Public Functions

inline virtual bool configure() override
inline virtual bool update(const sensor_msgs::msg::LaserScan &input_scan, sensor_msgs::msg::LaserScan &output_scan) override
inline void footprintCB(const geometry_msgs::msg::Polygon::SharedPtr polygon)

Protected Functions

inline bool transformPolygon(const std::string &input_scan_frame_id)
inline virtual rcl_interfaces::msg::SetParametersResult reconfigureCB(std::vector<rclcpp::Parameter> parameters) override