ResultTrajectory.h
Go to the documentation of this file.
1 /*
2  * OpenVINS: An Open Platform for Visual-Inertial Research
3  * Copyright (C) 2018-2023 Patrick Geneva
4  * Copyright (C) 2018-2023 Guoquan Huang
5  * Copyright (C) 2018-2023 OpenVINS Contributors
6  * Copyright (C) 2018-2019 Kevin Eckenhoff
7  *
8  * This program is free software: you can redistribute it and/or modify
9  * it under the terms of the GNU General Public License as published by
10  * the Free Software Foundation, either version 3 of the License, or
11  * (at your option) any later version.
12  *
13  * This program is distributed in the hope that it will be useful,
14  * but WITHOUT ANY WARRANTY; without even the implied warranty of
15  * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
16  * GNU General Public License for more details.
17  *
18  * You should have received a copy of the GNU General Public License
19  * along with this program. If not, see <https://www.gnu.org/licenses/>.
20  */
21 
22 #ifndef OV_EVAL_TRAJECTORY_H
23 #define OV_EVAL_TRAJECTORY_H
24 
25 #include <fstream>
26 #include <map>
27 #include <random>
28 #include <sstream>
29 #include <string>
30 #include <unordered_map>
31 
32 #include <Eigen/Eigen>
33 #include <Eigen/StdVector>
34 
36 #include "utils/Loader.h"
37 #include "utils/Statistics.h"
38 
39 #include "utils/colors.h"
40 #include "utils/print.h"
41 #include "utils/quat_ops.h"
42 
43 namespace ov_eval {
44 
60 
61 public:
68  ResultTrajectory(std::string path_est, std::string path_gt, std::string alignment_method);
69 
82  void calculate_ate(Statistics &error_ori, Statistics &error_pos);
83 
97  void calculate_ate_2d(Statistics &error_ori, Statistics &error_pos);
98 
113  void calculate_rpe(const std::vector<double> &segment_lengths, std::map<double, std::pair<Statistics, Statistics>> &error_rpe);
114 
127  void calculate_nees(Statistics &nees_ori, Statistics &nees_pos);
128 
148  void calculate_error(Statistics &posx, Statistics &posy, Statistics &posz, Statistics &orix, Statistics &oriy, Statistics &oriz,
149  Statistics &roll, Statistics &pitch, Statistics &yaw);
150 
151 protected:
152  // Trajectory data (loaded from file and timestamp intersected)
153  std::vector<double> est_times, gt_times;
154  std::vector<Eigen::Matrix<double, 7, 1>> est_poses, gt_poses;
155  std::vector<Eigen::Matrix3d> est_covori, est_covpos, gt_covori, gt_covpos;
156 
157  // Aligned trajectories
158  std::vector<Eigen::Matrix<double, 7, 1>> est_poses_aignedtoGT;
159  std::vector<Eigen::Matrix<double, 7, 1>> gt_poses_aignedtoEST;
160 
169  std::vector<int> compute_comparison_indices_length(std::vector<double> &distances, double distance, double max_dist_diff) {
170 
171  // Vector of end ids for our pose indexes
172  std::vector<int> comparisons;
173 
174  // Loop through each pose in our trajectory (i.e. our distance vector generated from the trajectory).
175  for (size_t idx = 0; idx < distances.size(); idx++) {
176 
177  // Loop through and find the pose that minimized the difference between
178  // The desired trajectory distance and our current trajectory distance
179  double distance_startpose = distances.at(idx);
180  int best_idx = -1;
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) {
184  best_idx = i;
185  best_error = std::abs(distances.at(i) - (distance_startpose + distance));
186  }
187  }
188 
189  // If we have an end id that reached this trajectory distance then add it!
190  // Else this isn't a valid segment, thus we shouldn't add it (we will try again at the next pose)
191  // NOTE: just because we searched through all poses and didn't find a close one doesn't mean we have ended
192  // NOTE: this could happen if there is a gap in the groundtruth poses and we just couldn't find a pose with low error
193  comparisons.push_back(best_idx);
194  }
195 
196  // Finally return the ids for each starting pose that have this distance
197  return comparisons;
198  }
199 };
200 
201 } // namespace ov_eval
202 
203 #endif // OV_EVAL_TRAJECTORY_H
Statistics object for a given set scalar time series values.
Definition: Statistics.h:39
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


ov_eval
Author(s): Patrick Geneva , Kevin Eckenhoff , Guoquan Huang
autogenerated on Wed Jun 21 2023 03:05:40