#include <map>
#include <string>
#include "cartographer/io/proto_stream.h"
#include "cartographer/io/proto_stream_deserializer.h"
#include "cartographer/io/submap_painter.h"
#include "cartographer/mapping/2d/probability_grid.h"
#include "cartographer/mapping/2d/submap_2d.h"
#include "cartographer/mapping/3d/submap_3d.h"
#include "cartographer/mapping/proto/pose_graph.pb.h"
#include "cartographer/mapping/proto/serialization.pb.h"
#include "cartographer/mapping/proto/submap.pb.h"
#include "cartographer/mapping/proto/trajectory_builder_options.pb.h"
#include "cartographer_ros/msg_conversion.h"
#include "cartographer_ros/node_constants.h"
#include "cartographer_ros/ros_log_sink.h"
#include "cartographer_ros/ros_map.h"
#include "cartographer_ros/submap.h"
#include "gflags/gflags.h"
#include "glog/logging.h"
#include "nav_msgs/OccupancyGrid.h"
#include "ros/ros.h"
Go to the source code of this file.
|
| DEFINE_double (resolution, 0.05, "Resolution of a grid cell in the drawn map.") |
|
| DEFINE_string (pbstream_filename, "", "Filename of a pbstream to draw a map from.") |
|
| DEFINE_string (map_topic, "map", "Name of the published map topic.") |
|
| DEFINE_string (map_frame_id, "map", "Frame ID of the published map.") |
|
int | main (int argc, char **argv) |
|
◆ DEFINE_double()
DEFINE_double |
( |
resolution |
, |
|
|
0. |
05, |
|
|
"Resolution of a grid cell in the drawn map." |
|
|
) |
| |
◆ DEFINE_string() [1/3]
DEFINE_string |
( |
pbstream_filename |
, |
|
|
"" |
, |
|
|
"Filename of a pbstream to draw a map from." |
|
|
) |
| |
◆ DEFINE_string() [2/3]
DEFINE_string |
( |
map_topic |
, |
|
|
"map" |
, |
|
|
"Name of the published map topic." |
|
|
) |
| |
◆ DEFINE_string() [3/3]
DEFINE_string |
( |
map_frame_id |
, |
|
|
"map" |
, |
|
|
"Frame ID of the published map." |
|
|
) |
| |
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |