Class ImageToGridmapDemo

Inheritance Relationships

Base Type

  • public rclcpp::Node

Class Documentation

class ImageToGridmapDemo : public rclcpp::Node

Loads an image and saves it as layer ‘elevation’ of a grid map. The grid map is published and can be viewed in Rviz.

Public Functions

ImageToGridmapDemo()

Constructor.

Parameters:

nodeHandle – the ROS node handle.

virtual ~ImageToGridmapDemo()

Destructor.

bool readParameters()

Reads and verifies the ROS parameters.

Returns:

true if successful.

void imageCallback(const sensor_msgs::msg::Image::SharedPtr msg)