#include <map_merge/map_merge.h>
#include <thread>
#include <ros/console.h>
#include <ros/assert.h>
#include <occupancy_grid_utils/combine_grids.h>
#include <occupancy_grid_utils/coordinate_conversions.h>
#include <tf/transform_datatypes.h>
#include <combine_grids/estimate_transform.h>
Go to the source code of this file.
Namespaces | |
namespace | map_merge |
Functions | |
int | main (int argc, char **argv) |
geometry_msgs::Pose & | map_merge::operator+= (geometry_msgs::Pose &, const geometry_msgs::Pose &) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 448 of file map_merge.cpp.