#include "hogman_minimal/graph_optimizer_hogman/graph_optimizer3d_chol.h"#include "graph_optimizer.h"#include "posegraph3d_gradient.h"#include "posegraph.h"#include "dijkstra.h"#include "rotation_matrix.h"#include "angle.h"#include "quaternion.h"#include "axis_angle.h"#include <fstream>#include "graph_optimizer_chol.h"#include <sstream>#include "hogman_wrapper.h"#include "structs.h"#include "utils.h"#include "geometry_msgs/Pose.h"#include "articulation_models/utils.h"

Go to the source code of this file.
Functions | |
| void | add_edge (GraphOptimizer3D *optimizer, int id1, int id2, btTransform pose, double sigma_position, double sigma_orientation) |
| void | add_vertex (GraphOptimizer3D *optimizer, int id, btTransform pose) |
| PoseMap | hogman_solver (KinematicGraphType &graph, PoseIndex &poseIndex, PoseMap &observed, PoseMap &predictedEmpty, double sigma_position, double sigma_orientation, double timestamp) |
| void add_edge | ( | GraphOptimizer3D * | optimizer, | |
| int | id1, | |||
| int | id2, | |||
| btTransform | pose, | |||
| double | sigma_position, | |||
| double | sigma_orientation | |||
| ) |
Definition at line 39 of file hogman_wrapper.cpp.
| void add_vertex | ( | GraphOptimizer3D * | optimizer, | |
| int | id, | |||
| btTransform | pose | |||
| ) |
Definition at line 21 of file hogman_wrapper.cpp.
| PoseMap hogman_solver | ( | KinematicGraphType & | graph, | |
| PoseIndex & | poseIndex, | |||
| PoseMap & | observed, | |||
| PoseMap & | predictedEmpty, | |||
| double | sigma_position, | |||
| double | sigma_orientation, | |||
| double | timestamp | |||
| ) |
Definition at line 75 of file hogman_wrapper.cpp.