#include <geometry_msgs/PoseStamped.h>
#include <nav_msgs/Path.h>
#include <ros/ros.h>
#include "alignment/AlignTrajectory.h"
#include "alignment/AlignUtils.h"
#include "utils/Loader.h"
#include "utils/colors.h"
#include "utils/print.h"
#include "utils/quat_ops.h"
Go to the source code of this file.
◆ align_and_publish()
| void align_and_publish |
( |
const nav_msgs::Path::ConstPtr & |
msg | ) |
|
◆ main()
| int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ alignment_type
| std::string alignment_type |
◆ poses_gt
| std::vector<Eigen::Matrix<double, 7, 1> > poses_gt |
◆ pub_path
◆ times_gt
| std::vector<double> times_gt |