#include <map_merge.h>
Public Attributes | |
| geometry_msgs::Transform | initial_pose |
| ros::Subscriber | map_sub |
| ros::Subscriber | map_updates_sub |
| std::mutex | mutex |
| nav_msgs::OccupancyGrid::ConstPtr | readonly_map |
| nav_msgs::OccupancyGrid::Ptr | writable_map |
Definition at line 55 of file map_merge.h.
| geometry_msgs::Transform map_merge::MapSubscription::initial_pose |
Definition at line 60 of file map_merge.h.
| ros::Subscriber map_merge::MapSubscription::map_sub |
Definition at line 64 of file map_merge.h.
| ros::Subscriber map_merge::MapSubscription::map_updates_sub |
Definition at line 65 of file map_merge.h.
| std::mutex map_merge::MapSubscription::mutex |
Definition at line 58 of file map_merge.h.
| nav_msgs::OccupancyGrid::ConstPtr map_merge::MapSubscription::readonly_map |
Definition at line 62 of file map_merge.h.
| nav_msgs::OccupancyGrid::Ptr map_merge::MapSubscription::writable_map |
Definition at line 61 of file map_merge.h.