#include <fstream>
#include <iostream>
#include <map>
#include <set>
#include <string>
#include "cartographer/common/histogram.h"
#include "cartographer/common/make_unique.h"
#include "cartographer_ros/msg_conversion.h"
#include "gflags/gflags.h"
#include "glog/logging.h"
#include "nav_msgs/Odometry.h"
#include "ros/ros.h"
#include "ros/time.h"
#include "rosbag/bag.h"
#include "rosbag/view.h"
#include "sensor_msgs/Imu.h"
#include "sensor_msgs/LaserScan.h"
#include "sensor_msgs/MultiEchoLaserScan.h"
#include "sensor_msgs/PointCloud2.h"
#include "tf2_eigen/tf2_eigen.h"
#include "tf2_msgs/TFMessage.h"
#include "tf2_ros/buffer.h"
#include "urdf/model.h"
Go to the source code of this file.
|
| DEFINE_bool (dump_timing, false, "Dump per-sensor timing information in files called " "timing_<frame_id>.csv in the current directory.") |
|
| DEFINE_string (bag_filename, "", "Bag to process.") |
|
int | main (int argc, char **argv) |
|
◆ DEFINE_bool()
DEFINE_bool |
( |
dump_timing |
, |
|
|
false |
, |
|
|
"Dump per-sensor timing information in files called " "timing_<frame_id>.csv in the current directory." |
|
|
) |
| |
◆ DEFINE_string()
DEFINE_string |
( |
bag_filename |
, |
|
|
"" |
, |
|
|
"Bag to process." |
|
|
) |
| |
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ data_type
◆ frame_id_to_max_overlap_duration_
std::map<std::string, double> frame_id_to_max_overlap_duration_ |
|
private |
◆ frame_id_to_previous_time_to_
◆ frame_id_to_range_checksum_
std::map<std::string, RangeChecksum> frame_id_to_range_checksum_ |
|
private |
◆ last_timestamp
◆ time_deltas
std::vector<float> time_deltas |
◆ timing_file
std::unique_ptr<std::ofstream> timing_file |
◆ topic