9 #include <gtsam_unstable/dllexport.h> 34 : Base(
Pose3(rot, t), vel) {}
36 : Base(
Pose3(rot, t), vel) {}
49 PoseRTV(
double roll,
double pitch,
double yaw,
double x,
double y,
double z,
50 double vx,
double vy,
double vz);
57 const Velocity3&
v()
const {
return second; }
64 const Velocity3&
velocity()
const {
return second; }
74 void print(
const std::string&
s=
"")
const;
78 using Base::dimension;
82 using Base::localCoordinates;
83 using Base::LocalCoordinates;
90 double range(
const PoseRTV& other,
100 PoseRTV planarDynamics(
double vel_rate,
double heading_rate,
double max_accel,
double dt)
const;
106 PoseRTV flyingDynamics(
double pitch_rate,
double heading_rate,
double lift_control,
double dt)
const;
114 Vector6 imuPrediction(
const PoseRTV&
x2,
double dt)
const;
119 Point3 translationIntegration(
const Rot3&
r2,
const Velocity3&
v2,
double dt)
const;
130 return translationIntegration(x2, dt);
141 ChartJacobian Dglobal = boost::none,
161 friend class boost::serialization::access;
162 template<
class Archive>
164 ar & BOOST_SERIALIZATION_NVP(
first);
165 ar & BOOST_SERIALIZATION_NVP(second);
174 template <
typename A1,
typename A2>
struct Range;
void print(const Matrix &A, const string &s, ostream &stream)
int EIGEN_BLAS_FUNC() rot(int *n, RealScalar *px, int *incx, RealScalar *py, int *incy, RealScalar *pc, RealScalar *ps)
Vector translationVec() const
const Velocity3 & velocityVec() const
PoseRTV(const Point3 &t, const Rot3 &rot, const Velocity3 &vel)
Point3 translationIntegration(const PoseRTV &x2, double dt) const
static const Velocity3 vel(0.4, 0.5, 0.6)
const Pose3 & pose() const
Vector3 Velocity3
Velocity is currently typedef'd to Vector3.
PoseRTV(const Pose3 &pose, const Velocity3 &vel)
Pose3 x2(Rot3::Ypr(0.0, 0.0, 0.0), l2)
Group product of two Lie Groups.
Matrix trans(const Matrix &A)
PoseRTV(const Base &base)
StridedVectorType vy(make_vector(y,*n, std::abs(*incy)))
constexpr int first(int i)
Implementation details for constexpr functions.
const Velocity3 & v() const
static const Pose3 pose(Rot3(Vector3(1,-1,-1).asDiagonal()), Point3(0, 0, 0.5))
Array< double, 1, 3 > e(1./3., 0.5, 2.)
void serialize(Archive &ar, const unsigned int)
Velocity3_ velocity(const NavState_ &X)
const mpreal dim(const mpreal &a, const mpreal &b, mp_rnd_t r=mpreal::get_default_rnd())
PoseRTV(const Rot3 &rot, const Point3 &t, const Velocity3 &vel)
ProductLieGroup< Pose3, Velocity3 > Base
const Velocity3 & velocity() const
PoseRTV(const Pose3 &pose)
Both LieGroupTraits and Testable.
OptionalJacobian< 9, 9 > ChartJacobian
const Point3 & translation() const
StridedVectorType vx(make_vector(x,*n, std::abs(*incx)))
Annotation indicating that a class derives from another given type.
set noclip points set clip one set noclip two set bar set border lt lw set xdata set ydata set zdata set x2data set y2data set boxwidth set dummy x
Vector translationIntegrationVec(const PoseRTV &x2, double dt) const
const Rot3 & rotation() const