Class PointPerceptionHandler
Defined in File PointPerception.hpp
Inheritance Relationships
Base Type
public easynav::PerceptionHandler(Class PerceptionHandler)
Class Documentation
PerceptionHandler implementation for sensors producing point-based data.
Supports both
sensor_msgs::msg::LaserScanandsensor_msgs::msg::PointCloud2, converting incoming messages into PointPerception instances.Public Functions
Returns the sensor group handled by this handler.
- Returns:
The string literal
"points".
Creates a new PointPerception instance.
- Parameters:
sensor_id – Identifier of the sensor (currently unused, kept for future extensions).
- Returns:
Shared pointer to a new PointPerception.
Creates a subscription to
LaserScanorPointCloud2messages and updates the perception.The created subscription decodes incoming messages from
topicaccording totype, converts them into a point cloud, and writes the result intotarget(including metadata such asstampandframe_id).- Parameters:
node – Lifecycle node used to create the subscription.
topic – Topic name to subscribe to.
type – ROS message type name. Must be either
"sensor_msgs/msg/LaserScan"or"sensor_msgs/msg/PointCloud2".target – Shared pointer to the perception instance to be updated.
cb_group – Callback group for the subscription callback (executor-level concurrency control).
- Returns:
Shared pointer to the created subscription.