Implementation of nav_msgs/OccupancyGrid
wrapper type.
More...
#include <cmath>
#include <memory>
#include <utility>
#include <vector>
#include <sophus/se2.hpp>
#include <sophus/so2.hpp>
#include <tf2/utils.h>
#include <beluga/sensor/data/occupancy_grid.hpp>
#include <beluga_ros/messages.hpp>
Go to the source code of this file.
Classes | |
class | beluga_ros::OccupancyGrid |
Thin wrapper type for 2D nav_msgs/OccupancyGrid messages. More... | |
struct | beluga_ros::OccupancyGrid::ValueTraits |
Traits for occupancy grid value interpretation. More... | |
Namespaces | |
beluga_ros | |
The main Beluga ROS namespace. | |
Implementation of nav_msgs/OccupancyGrid
wrapper type.
Definition in file occupancy_grid.hpp.