#include <iostream>
#include <string>
#include <vector>
#include "absl/strings/str_cat.h"
#include "cartographer/transform/transform.h"
#include "cartographer_ros/msg_conversion.h"
#include "cartographer_ros/time_conversion.h"
#include "geometry_msgs/TransformStamped.h"
#include "gflags/gflags.h"
#include "glog/logging.h"
#include "rosbag/bag.h"
#include "tf2_msgs/TFMessage.h"
Go to the source code of this file.
Function Documentation
DEFINE_string |
( |
parent_frame |
, |
|
|
"map" |
, |
|
|
"Frame id to use as parent frame." |
|
|
) |
| |
int main |
( |
int |
argc, |
|
|
char * |
argv[] |
|
) |
| |