Go to the documentation of this file.
10 using namespace gtsam;
19 const double a = 5,
b = 10;
39 Vector4
v1(0, 0, -1, 0);
44 Vector4
v2(0, 0, 0, -1);
50 Vector4
v3(-
M_PI / 4, 0, 0, 0);
56 Vector4 v4(0, -
M_PI / 4, 0, 0);
75 Vector4
v1(0, 0, 0, 1);
80 Vector4
v2(0, 0, 1, 0);
85 Vector4
v3(
M_PI / 4, 0, 0, 0);
92 Vector4 v4(0,
M_PI / 4, 0, 0);
98 Vector4 v5(
M_PI / 3, -
M_PI / 4, -0.4, 1.2);
119 Vector4
r2(2.3, 0.987, -3, 4);
static int runAllTests(TestResult &result)
#define EXPECT_CORRECT_FACTOR_JACOBIANS(factor, values, numerical_derivative_step, tolerance)
Check the Jacobians produced by a factor against finite differences.
Array< double, 1, 3 > e(1./3., 0.5, 2.)
#define GTSAM_CONCEPT_TESTABLE_INST(T)
Concept check for values that can be used in unit tests.
#define EXPECT(condition)
bool equals(const Line3 &l2, double tol=10e-9) const
Expression< Point2 > projection(f, p_cam)
def retract(a, np.ndarray xi)
Some functions to compute numerical derivatives.
Line3 transformTo(const Pose3 &wTc, const Line3 &wL, OptionalJacobian< 4, 6 > Dpose, OptionalJacobian< 4, 4 > Dline)
Rot3 is a 3D rotation represented as a rotation matrix if the preprocessor symbol GTSAM_USE_QUATERNIO...
static const Line3 l(Rot3(), 1, 1)
noiseModel::Base::shared_ptr SharedNoiseModel
Vector4 localCoordinates(const Line3 &q, OptionalJacobian< 4, 4 > Dp={}, OptionalJacobian< 4, 4 > Dq={}) const
Unit3 project(OptionalJacobian< 2, 4 > Dline={}) const
noiseModel::Diagonal::shared_ptr model
#define EXPECT_DOUBLES_EQUAL(expected, actual, threshold)
Rot3 inverse() const
inverse of a rotation
Test harness methods for expressions.
Point2(* f)(const Point3 &, OptionalJacobian< 2, 3 >)
4 dimensional manifold of 3D lines
TEST(SmartFactorBase, Pinhole)
Line3 retract(const Vector4 &v, OptionalJacobian< 4, 4 > Dp={}, OptionalJacobian< 4, 4 > Dv={}) const
Common expressions for solving geometry/slam/sfm problems.
static Rot3 Expmap(const Vector3 &v, OptionalJacobian< 3, 3 > H={})
void insert(Key j, const Value &val)
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
#define GTSAM_CONCEPT_MANIFOLD_INST(T)
**
static shared_ptr Sigma(size_t dim, double sigma, bool smart=true)
Represents a 3D point on a unit sphere.
static Unit3 FromPoint3(const Point3 &point, OptionalJacobian< 2, 3 > H={})
Named constructor from Point3 with optional Jacobian.
Rot2 R(Rot2::fromAngle(0.1))
gtsam
Author(s):
autogenerated on Sat Nov 16 2024 04:07:50