#include <memory>#include <ros/ros.h>#include <tf2_ros/transform_listener.h>#include <moveit/occupancy_map_monitor/occupancy_map_monitor.h>#include <octomap_msgs/conversions.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| static void | publishOctomap (ros::Publisher &octree_binary_pub, occupancy_map_monitor::OccupancyMapMonitor &server) |
Variables | |
| static const std::string | LOGNAME = "occupancy_map_server" |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 67 of file occupancy_map_server.cpp.
|
static |
Definition at line 45 of file occupancy_map_server.cpp.
|
static |
Definition at line 43 of file occupancy_map_server.cpp.