22 #ifndef OV_EVAL_TRAJECTORY_H 23 #define OV_EVAL_TRAJECTORY_H 30 #include <unordered_map> 32 #include <Eigen/Eigen> 33 #include <Eigen/StdVector> 68 ResultTrajectory(std::string path_est, std::string path_gt, std::string alignment_method);
113 void calculate_rpe(
const std::vector<double> &segment_lengths, std::map<
double, std::pair<Statistics, Statistics>> &error_rpe);
172 std::vector<int> comparisons;
175 for (
size_t idx = 0; idx < distances.size(); idx++) {
179 double distance_startpose = distances.at(idx);
181 double best_error = max_dist_diff;
182 for (
size_t i = idx; i < distances.size(); i++) {
183 if (std::abs(distances.at(i) - (distance_startpose + distance)) < best_error) {
185 best_error = std::abs(distances.at(i) - (distance_startpose + distance));
193 comparisons.push_back(best_idx);
203 #endif // OV_EVAL_TRAJECTORY_H Statistics object for a given set scalar time series values.
std::vector< Eigen::Matrix< double, 7, 1 > > est_poses
std::vector< Eigen::Matrix< double, 7, 1 > > est_poses_aignedtoGT
void calculate_nees(Statistics &nees_ori, Statistics &nees_pos)
Computes the Normalized Estimation Error Squared (NEES) for this trajectory.
std::vector< Eigen::Matrix< double, 7, 1 > > gt_poses_aignedtoEST
void calculate_error(Statistics &posx, Statistics &posy, Statistics &posz, Statistics &orix, Statistics &oriy, Statistics &oriz, Statistics &roll, Statistics &pitch, Statistics &yaw)
Computes the error at each timestamp for this trajectory.
std::vector< double > gt_times
Evaluation and recording utilities.
std::vector< Eigen::Matrix3d > est_covori
ResultTrajectory(std::string path_est, std::string path_gt, std::string alignment_method)
Default constructor that will load, intersect, and align our trajectories.
std::vector< Eigen::Matrix3d > est_covpos
std::vector< Eigen::Matrix3d > gt_covpos
void calculate_ate(Statistics &error_ori, Statistics &error_pos)
Computes the Absolute Trajectory Error (ATE) for this trajectory.
A single run for a given dataset.
std::vector< Eigen::Matrix3d > gt_covori
void calculate_ate_2d(Statistics &error_ori, Statistics &error_pos)
Computes the Absolute Trajectory Error (ATE) for this trajectory in the 2d x-y plane.
std::vector< int > compute_comparison_indices_length(std::vector< double > &distances, double distance, double max_dist_diff)
Gets the indices at the end of subtractories of a given length when starting at each index...
std::vector< Eigen::Matrix< double, 7, 1 > > gt_poses
void calculate_rpe(const std::vector< double > &segment_lengths, std::map< double, std::pair< Statistics, Statistics >> &error_rpe)
Computes the Relative Pose Error (RPE) for this trajectory.
std::vector< double > est_times