28 using namespace gtsam;
31 TEST( LinearizedFactor, equals_jacobian )
54 TEST( LinearizedFactor, clone_jacobian )
77 Matrix information1 = jf1->augmentedInformation();
78 Matrix information2 = jf2->augmentedInformation();
83 TEST( LinearizedFactor, add_jacobian )
164 TEST( LinearizedFactor, equals_hessian )
188 TEST( LinearizedFactor, clone_hessian )
212 TEST( LinearizedFactor, add_hessian )
static int runAllTests(TestResult &result)
A non-templated config holding any types of Manifold-group elements.
Factor Graph consisting of non-linear factors.
std::shared_ptr< This > shared_ptr
A shared_ptr to this class.
noiseModel::Diagonal::shared_ptr model
IsDerived< DERIVEDFACTOR > push_back(std::shared_ptr< DERIVEDFACTOR > factor)
Add a factor directly using a shared_ptr.
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
Some functions to compute numerical derivatives.
Pose3 x2(Rot3::Ypr(0.0, 0.0, 0.0), l2)
std::shared_ptr< LinearizedJacobianFactor > shared_ptr
gtsam::NonlinearFactor::shared_ptr clone() const override
A dummy factor that allows a linear factor to act as a nonlinear factor.
std::shared_ptr< This > shared_ptr
shared_ptr to this class
std::shared_ptr< GaussianFactor > linearize(const Values &x) const override
NonlinearFactorGraph graph2()
A Gaussian factor using the canonical parameters (information form)
void insert(Key j, const Value &val)
TEST(SmartFactorBase, Pinhole)
std::shared_ptr< LinearizedHessianFactor > shared_ptr
std::uint64_t Key
Integer nonlinear key type.
noiseModel::Base::shared_ptr SharedNoiseModel
static shared_ptr Sigma(size_t dim, double sigma, bool smart=true)