16 using namespace gtsam;
    17 using namespace imuBias;
    49   Vector3 biasGyro(0.1, 0.2, 0.3);
    53                                    noiseModel::Isotropic::Sigma(6, 0.1));
    61       (Vector6() << 1.1, 2.1, 3.1, 0.2, 0.3, 0.4).finished());
    63   values.
insert(1, incorrectBias);
 Vector evaluateError(const T &x, OptionalMatrixType H) const override
static int runAllTests(TestResult &result)
noiseModel::Diagonal::shared_ptr model
Evaluate derivatives of a nonlinear factor numerically. 
#define EXPECT_DOUBLES_EQUAL(expected, actual, threshold)
Array< int, Dynamic, 1 > v
Array< double, 1, 3 > e(1./3., 0.5, 2.)
typedef and functions to augment Eigen's VectorXd 
double error(const Values &c) const override
#define EXPECT_CORRECT_FACTOR_JACOBIANS(factor, values, numerical_derivative_step, tolerance)
Check the Jacobians produced by a factor against finite differences. 
Vector callEvaluateError(const PriorFactor< ConstantBias > &factor, const ConstantBias &bias)
TEST(PriorFactor, ConstructorScalar)
void insert(Key j, const Value &val)
noiseModel::Base::shared_ptr SharedNoiseModel