#include "cartographer/common/time.h"
#include "cartographer_ros/ros_log_sink.h"
#include "cartographer_ros/time_conversion.h"
#include "gflags/gflags.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_msgs/TFMessage.h"
Go to the source code of this file.
Functions | |
DEFINE_string (bag_filename,"","Bag to publish.") | |
int | main (int argc, char **argv) |
template<typename MessagePtrType > | |
void | PublishWithModifiedTimestamp (MessagePtrType message, const ros::Publisher &publisher, ros::Duration bag_to_current) |
template<> | |
void | PublishWithModifiedTimestamp< tf2_msgs::TFMessage::Ptr > (tf2_msgs::TFMessage::Ptr message, const ros::Publisher &publisher, ros::Duration bag_to_current) |
Variables | |
const int | kQueueSize = 1 |
DEFINE_string | ( | bag_filename | , |
"" | , | ||
"Bag to publish." | |||
) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 56 of file rosbag_publisher_main.cc.
void PublishWithModifiedTimestamp | ( | MessagePtrType | message, |
const ros::Publisher & | publisher, | ||
ros::Duration | bag_to_current | ||
) |
Definition at line 37 of file rosbag_publisher_main.cc.
void PublishWithModifiedTimestamp< tf2_msgs::TFMessage::Ptr > | ( | tf2_msgs::TFMessage::Ptr | message, |
const ros::Publisher & | publisher, | ||
ros::Duration | bag_to_current | ||
) |
Definition at line 46 of file rosbag_publisher_main.cc.
const int kQueueSize = 1 |
Definition at line 34 of file rosbag_publisher_main.cc.