#include <string>
#include <vector>
#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <nav_msgs/OccupancyGrid.h>
#include "../core/state_data.h"
#include "../core/maps/grid_map.h"
Go to the source code of this file.
Classes | |
class | RvizGridViewer |
The class publishes information about robot's map and location in ROS-compatible format so it can be shown by rviz. More... | |