Class PointPerception

Inheritance Relationships

Base Type

Class Documentation

class PointPerception : public easynav::PerceptionBase

Concrete perception class for 3D point cloud data.

Stores a point cloud of type pcl::PointCloud<pcl::PointXYZ> and the common metadata inherited from PerceptionBase.

Public Functions

inline void resize(std::size_t size)

Resizes the internal point cloud storage.

Parameters:

size – Number of points to allocate in data.

Public Members

pcl::PointCloud<pcl::PointXYZ> data

The 3D point cloud data associated with this perception.

Public Static Functions

static inline bool supports_msg_type(std::string_view t)

Checks if a ROS message type is supported by this perception.

Parameters:

t – Fully-qualified ROS 2 message type name (e.g., "sensor_msgs/msg/PointCloud2").

Returns:

true if t is sensor_msgs/msg/LaserScan or sensor_msgs/msg/PointCloud2, otherwise false.

Public Static Attributes

static constexpr std::string_view default_group_ = "points"

Group identifier for point perceptions.