Classes | |
class | AngleLocalParameterization |
struct | Constraint2d |
struct | Constraint3d |
struct | Pose2d |
struct | Pose3d |
class | PoseGraph2dErrorTerm |
class | PoseGraph3dErrorTerm |
Typedefs | |
typedef std::map< int, Pose3d, std::less< int >, Eigen::aligned_allocator< std::pair< const int, Pose3d > > > | MapOfPoses |
typedef std::vector< Constraint3d, Eigen::aligned_allocator< Constraint3d > > | VectorOfConstraints |
Functions | |
template<typename T > | |
T | NormalizeAngle (const T &angle_radians) |
std::istream & | operator>> (std::istream &input, Pose3d &pose) |
std::istream & | operator>> (std::istream &input, Pose2d &pose) |
std::istream & | operator>> (std::istream &input, Constraint2d &constraint) |
std::istream & | operator>> (std::istream &input, Constraint3d &constraint) |
template<typename T > | |
Eigen::Matrix< T, 2, 2 > | RotationMatrix2D (T yaw_radians) |
typedef std::map<int, Pose3d, std::less<int>, Eigen::aligned_allocator<std::pair<const int, Pose3d> > > ceres::examples::MapOfPoses |
Definition at line 68 of file pose_graph_3d/types.h.
typedef std::vector<Constraint3d, Eigen::aligned_allocator<Constraint3d> > ceres::examples::VectorOfConstraints |
Definition at line 109 of file pose_graph_3d/types.h.
Definition at line 57 of file normalize_angle.h.
|
inline |
Definition at line 57 of file pose_graph_3d/types.h.
|
inline |
Definition at line 58 of file pose_graph_2d/types.h.
|
inline |
Definition at line 85 of file pose_graph_2d/types.h.
|
inline |
Definition at line 93 of file pose_graph_3d/types.h.
Eigen::Matrix<T, 2, 2> ceres::examples::RotationMatrix2D | ( | T | yaw_radians | ) |
Definition at line 42 of file pose_graph_2d_error_term.h.