Class LaserScanDisplay

Inheritance Relationships

Base Type

  • public rviz_common::MessageFilterDisplay< sensor_msgs::msg::LaserScan >

Class Documentation

class LaserScanDisplay : public rviz_common::MessageFilterDisplay<sensor_msgs::msg::LaserScan>

Visualizes a laser scan, received as a sensor_msgs::LaserScan.

Public Functions

LaserScanDisplay()
~LaserScanDisplay() override = default
void reset() override
void update(float wall_dt, float ros_dt) override
void onDisable() override

Protected Functions

void onInitialize() override

Do initialization. Overridden from MessageFilterDisplay.

void processMessage(sensor_msgs::msg::LaserScan::ConstSharedPtr scan) override

Process a single message. Overridden from MessageFilterDisplay.

void checkTolerance(rclcpp::Duration tolerance)

create a status warning when tolerance is larger than 1s

Protected Attributes

std::unique_ptr<PointCloudCommon> point_cloud_common_
std::unique_ptr<laser_geometry::LaserProjection> projector_
rclcpp::Duration filter_tolerance_