#include "absl/memory/memory.h"
#include "cartographer/cloud/client/map_builder_stub.h"
#include "cartographer_ros/node.h"
#include "cartographer_ros/node_options.h"
#include "cartographer_ros/ros_log_sink.h"
#include "gflags/gflags.h"
#include "tf2_ros/transform_listener.h"
Go to the source code of this file.
Namespaces | |
namespace | cartographer_ros |
Functions | |
DEFINE_bool (collect_metrics, false,"Activates the collection of runtime metrics. If activated, the ""metrics can be accessed via a ROS service.") | |
DEFINE_bool (start_trajectory_with_default_topics, true,"Enable to immediately start the first trajectory with default topics.") | |
DEFINE_bool (load_frozen_state, true,"Load the saved state as frozen (non-optimized) trajectories.") | |
DEFINE_bool (upload_load_state_file, false,"Upload the .pbstream file from a local path to the (remote) gRPC ""server instead of loading it from the server file system.") | |
DEFINE_string (configuration_directory,"","First directory in which configuration files are searched, ""second is always the Cartographer installation to allow ""including files from there.") | |
DEFINE_string (configuration_basename,"","Basename, i.e. not containing any directory prefix, of the ""configuration file.") | |
DEFINE_string (server_address,"localhost:50051","gRPC server address to stream the sensor data to.") | |
DEFINE_string (save_map_filename,"","If non-empty, serialize state and write it to disk before shutting down.") | |
DEFINE_string (load_state_filename,"","If non-empty, filename of a .pbstream file ""to load, containing a saved SLAM state. ""Unless --upload_load_state_file is set, the filepath refers ""to the gRPC server's file system.") | |
DEFINE_string (client_id,"","Cartographer client ID to use when connecting to the server.") | |
int | main (int argc, char **argv) |
DEFINE_bool | ( | collect_metrics | , |
false | , | ||
"Activates the collection of runtime metrics. If | activated, | ||
the""metrics can be accessed via a ROS service." | |||
) |
DEFINE_bool | ( | start_trajectory_with_default_topics | , |
true | , | ||
"Enable to immediately start the first trajectory with default topics." | |||
) |
DEFINE_bool | ( | load_frozen_state | , |
true | , | ||
"Load the saved state as frozen (non-optimized) trajectories." | |||
) |
DEFINE_bool | ( | upload_load_state_file | , |
false | , | ||
"Upload the .pbstream file from a local path to the (remote) gRPC ""server instead of loading it from the server file system." | |||
) |
DEFINE_string | ( | configuration_directory | , |
"" | , | ||
"First directory in which configuration files are | searched, | ||
""second is always the Cartographer installation to allow""including files from there." | |||
) |
DEFINE_string | ( | configuration_basename | , |
"" | , | ||
" | Basename, | ||
i.e.not containing any directory | prefix, | ||
of the""configuration file." | |||
) |
DEFINE_string | ( | server_address | , |
"localhost:50051" | , | ||
"gRPC server address to stream the sensor data to." | |||
) |
DEFINE_string | ( | save_map_filename | , |
"" | , | ||
"If non- | empty, | ||
serialize state and write it to disk before shutting down." | |||
) |
DEFINE_string | ( | load_state_filename | , |
"" | , | ||
"If non- | empty, | ||
filename of a.pbstream file""to | load, | ||
containing a saved SLAM state.""Unless--upload_load_state_file is | set, | ||
the filepath refers""to the gRPC server's file system." | |||
) |
DEFINE_string | ( | client_id | , |
"" | , | ||
"Cartographer client ID to use when connecting to the server." | |||
) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 101 of file node_grpc_main.cc.