#include <CppUnitLite/TestHarness.h>
#include <gtsam/base/numericalDerivative.h>
#include <gtsam/base/Testable.h>
#include <gtsam/geometry/PinholeCamera.h>
#include <gtsam/geometry/Cal3_S2.h>
#include <gtsam_unstable/geometry/InvDepthCamera3.h>
Go to the source code of this file.
Functions | |
static Cal3_S2::shared_ptr | K (new Cal3_S2(1500, 1200, 0, 640, 480)) |
PinholeCamera< Cal3_S2 > | level_camera (level_pose,*K) |
int | main () |
Point2 | project_ (const Pose3 &pose, const Vector5 &landmark, const double &inv_depth) |
TEST (InvDepthFactor, Project1) | |
TEST (InvDepthFactor, Project2) | |
TEST (InvDepthFactor, Project3) | |
TEST (InvDepthFactor, Project4) | |
TEST (InvDepthFactor, Dproject_pose) | |
TEST (InvDepthFactor, Dproject_landmark) | |
TEST (InvDepthFactor, Dproject_inv_depth) | |
TEST (InvDepthFactor, backproject) | |
TEST (InvDepthFactor, backproject2) | |
Variables | |
Pose3 | level_pose = Pose3(Rot3::Ypr(-M_PI/2, 0., -M_PI/2), gtsam::Point3(0,0,1)) |
|
static |
PinholeCamera<Cal3_S2> level_camera | ( | level_pose | , |
* | K | ||
) |
int main | ( | void | ) |
Definition at line 157 of file testInvDepthCamera3.cpp.
Definition at line 87 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
Project1 | |||
) |
Definition at line 25 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
Project2 | |||
) |
Definition at line 41 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
Project3 | |||
) |
Definition at line 56 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
Project4 | |||
) |
Definition at line 71 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
Dproject_pose | |||
) |
Definition at line 90 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
Dproject_landmark | |||
) |
Definition at line 102 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
Dproject_inv_depth | |||
) |
Definition at line 114 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
backproject | |||
) |
Definition at line 126 of file testInvDepthCamera3.cpp.
TEST | ( | InvDepthFactor | , |
backproject2 | |||
) |
Definition at line 141 of file testInvDepthCamera3.cpp.
Pose3 level_pose = Pose3(Rot3::Ypr(-M_PI/2, 0., -M_PI/2), gtsam::Point3(0,0,1)) |
Definition at line 21 of file testInvDepthCamera3.cpp.