#include <atomic>#include <ros/common.h>#include <ros/node_handle.h>#include <ros/subscriber.h>#include <ros/publisher.h>#include <costmap_2d/costmap_2d.h>#include <costmap_2d/cost_values.h>#include <nav_msgs/OccupancyGrid.h>#include <cost_map_ros/converter.hpp>#include "../../include/cost_map_demos/from_ros_costmaps.hpp"
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 28 of file applications/from_ros_costmaps.cpp.