26 #include <boost/bind.hpp> 29 using namespace gtsam;
32 static const double ms = 1
e-3;
33 static const double cm = 1
e-2;
47 Event actual(t, 201.5 *
cm, 201.5 *
cm, (212 - 45) *
cm);
52 Event event(0, 1, 0, 0);
68 Matrix expectedH1 = numericalDerivative11<double, Event>(
72 Matrix expectedH2 = numericalDerivative11<double, Point3>(
static int runAllTests(TestResult &result)
Event retract(const Vector4 &v) const
Updates a with tangent space delta.
Eigen::Matrix< double, 1, 1 > Vector1
void insert(Key j, const Value &val)
Some functions to compute numerical derivatives.
#define EXPECT_DOUBLES_EQUAL(expected, actual, threshold)
Expressions for Block Automatic Differentiation.
static const Event exampleEvent(timeOfEvent, 1, 0, 0)
static const Point3 microphoneAt0(0, 0, 0)
#define EXPECT(condition)
Array< double, 1, 3 > e(1./3., 0.5, 2.)
Time of arrival to given sensor.
static SharedNoiseModel model(noiseModel::Isotropic::Sigma(1, 0.5 *ms))
bool assert_equal(const Matrix &expected, const Matrix &actual, double tol)
T value(const Values &values, boost::optional< std::vector< Matrix > & > H=boost::none) const
Return value and optional derivatives, reverse AD version Notes: this is not terribly efficient...
static const TimeOfArrival kToa(kSpeedOfSound)
The matrix class, also used for vectors and row-vectors.
static const double kSpeedOfSound
static const double timeOfEvent
std::uint64_t Key
Integer nonlinear key type.
noiseModel::Base::shared_ptr SharedNoiseModel