Namespaces | Classes | Typedefs | Functions | Variables
gtsam::internal Namespace Reference

Namespaces

 linearAlgorithms
 

Classes

struct  apply_compose
 
class  AutoTicToc
 
class  BinaryExpression
 Binary Expression. More...
 
class  BinarySumNode
 Binary Sum Expression. More...
 
struct  CallRecord
 
struct  CallRecordImplementor
 
class  ConstantExpression
 Constant Expression. More...
 
struct  ConvertToDynamicIf
 
struct  ConvertToDynamicIf< false >
 
struct  DoglegState
 
struct  DynamicTraits
 
class  ExecutionTrace
 
class  ExpressionNode
 
struct  FastDefaultAllocator
 Default allocator for list, map, and set types. More...
 
struct  FastDefaultVectorAllocator
 Default allocator for vector types (we never use boost pool for vectors) More...
 
struct  FixedSizeMatrix
 
struct  GetDimensionImpl
 Extra manifold traits for fixed-dimension types. More...
 
struct  GetDimensionImpl< Class, Eigen::Dynamic >
 Extra manifold traits for variable-dimension types. More...
 
struct  handle
 
struct  handle< Eigen::Matrix< double, M, N > >
 
struct  handle_matrix
 
struct  handle_matrix< Eigen::Matrix< double, M, N >, false >
 
struct  handle_matrix< Eigen::Matrix< double, M, N >, true >
 
struct  HasManifoldPrereqs
 Requirements on type to pass it to Manifold template below. More...
 
struct  HasVectorSpacePrereqs
 Requirements on type to pass it to Manifold template below. More...
 
struct  Jacobian
 meta-function to generate fixed-size JacobianTA type More...
 
class  JacobianMap
 
class  LeafExpression
 Leaf Expression, if no chart is given, assume default chart and value_type is just the plain value. More...
 
struct  LevenbergMarquardtState
 
struct  LieGroup
 Both LieGroupTraits and Testable. More...
 
struct  LieGroupTraits
 
struct  Manifold
 Both ManifoldTraits and Testable. More...
 
struct  ManifoldTraits
 
struct  NonlinearOptimizerState
 
class  ScalarMultiplyNode
 Expression for scalar multiplication. More...
 
struct  ScalarTraits
 
class  TernaryExpression
 Ternary Expression. More...
 
class  TimingOutline
 
class  UnaryExpression
 Unary Function Expression. More...
 
struct  UseBlockIf
 
struct  UseBlockIf< false, Derived >
 Handle Leaf Case for Dynamic Matrix type (slower) More...
 
struct  VectorSpace
 VectorSpace provides both Testable and VectorSpaceTraits. More...
 
struct  VectorSpaceImpl
 VectorSpaceTraits Implementation for Fixed sizes. More...
 
struct  VectorSpaceImpl< Class, Eigen::Dynamic >
 VectorSpaceTraits implementation for dynamic types. More...
 
struct  VectorSpaceTraits
 

Typedefs

typedef boost::aligned_storage< 1, TraceAlignment >::type ExecutionTraceStorage
 

Functions

Rot3 attitude (const NavState &X, OptionalJacobian< 3, 9 > H)
 
NonlinearFactorGraph calculateMarginalFactors (const NonlinearFactorGraph &graph, const Values &theta, const KeySet &remainingKeys, const GaussianFactorGraph::Eliminate &eliminateFunction)
 
constexpr int DimensionSO (int N)
 Calculate dimensionality of SO<N> manifold, or return Dynamic if so. More...
 
template<class FACTOR >
std::pair< boost::shared_ptr< SymbolicConditional >, boost::shared_ptr< SymbolicFactor > > EliminateSymbolic (const FactorGraph< FACTOR > &factors, const Ordering &keys)
 
GTSAM_EXPORT boost::weak_ptr< TimingOutlinegCurrentTimer (gTimingRoot)
 
size_t getTicTocID (const char *descriptionC)
 
GTSAM_EXPORT boost::shared_ptr< TimingOutlinegTimingRoot (new TimingOutline("Total", getTicTocID("Total")))
 
template<typename Derived >
void handleLeafCase (const Eigen::MatrixBase< Derived > &dTdA, JacobianMap &jacobians, Key key)
 Handle Leaf Case: reverse AD ends here, by writing a matrix into Jacobians. More...
 
double logDeterminant (const GaussianBayesTreeClique::shared_ptr &clique, double &parentSum)
 
template<class BAYESTREE >
double logDeterminant (const typename BAYESTREE::sharedClique &clique)
 
constexpr int NSquaredSO (int N)
 
template<class BAYESTREE >
void optimizeInPlace (const typename BAYESTREE::sharedClique &clique, VectorValues &result)
 
static void optimizeInPlace (const ISAM2::sharedClique &clique, VectorValues *result)
 
Point3 position (const NavState &X, OptionalJacobian< 3, 9 > H)
 
template<class T , class A >
static void PrintJacobianAndTrace (const std::string &indent, const typename Jacobian< T, A >::type &dTdA, const ExecutionTrace< A > trace)
 
template<class CAMERA , class POINT >
Point2 project4 (const CAMERA &camera, const POINT &p, OptionalJacobian< 2, CAMERA::dimension > Dcam, OptionalJacobian< 2, FixedDimension< POINT >::value > Dpoint)
 
template<class CALIBRATION , class POINT >
Point2 project6 (const Pose3 &x, const Point3 &p, const Cal3_S2 &K, OptionalJacobian< 2, 6 > Dpose, OptionalJacobian< 2, 3 > Dpoint, OptionalJacobian< 2, 5 > Dcal)
 
Rot3 rotation (const Pose3 &pose, OptionalJacobian< 3, 6 > H)
 
bool structureCompareOp (const boost::tuple< VectorValues::value_type, VectorValues::value_type > &vv)
 
template<typename T >
bool testExpressionJacobians (const std::string &name_, const gtsam::Expression< T > &expression, const gtsam::Values &values, double nd_step, double tolerance)
 
bool testFactorJacobians (const std::string &name_, const NoiseModelFactor &factor, const gtsam::Values &values, double delta, double tolerance)
 
void tic (size_t id, const char *labelC)
 
void toc (size_t id, const char *label)
 
template<typename T >
TupAlign (T &value, unsigned requiredAlignment=TraceAlignment)
 
template<typename T >
T upAligned (T value, unsigned requiredAlignment=TraceAlignment)
 
void updateRgProd (const ISAM2::sharedClique &clique, const KeySet &replacedKeys, const VectorValues &grad, VectorValues *RgProd, size_t *varsUpdated)
 
Velocity3 velocity (const NavState &X, OptionalJacobian< 3, 9 > H)
 

Variables

const int CallRecordMaxVirtualStaticRows = 5
 
GTSAM_EXTERN_EXPORT boost::weak_ptr< TimingOutlinegCurrentTimer
 
GTSAM_EXTERN_EXPORT boost::shared_ptr< TimingOutlinegTimingRoot
 
static const unsigned TraceAlignment = 32
 

Typedef Documentation

typedef boost::aligned_storage<1, TraceAlignment>::type gtsam::internal::ExecutionTraceStorage

Definition at line 39 of file ExecutionTrace.h.

Function Documentation

Rot3 gtsam::internal::attitude ( const NavState X,
OptionalJacobian< 3, 9 >  H 
)

Definition at line 22 of file navigation/expressions.h.

NonlinearFactorGraph gtsam::internal::calculateMarginalFactors ( const NonlinearFactorGraph graph,
const Values theta,
const KeySet remainingKeys,
const GaussianFactorGraph::Eliminate eliminateFunction 
)

Calculate the marginal on the specified keys, returning a set of LinearContainerFactors. Unlike other GTSAM functions with similar purposes, this version can operate on disconnected graphs.

Definition at line 54 of file ConcurrentFilteringAndSmoothing.cpp.

constexpr int gtsam::internal::DimensionSO ( int  N)

Calculate dimensionality of SO<N> manifold, or return Dynamic if so.

Definition at line 37 of file SOn.h.

template<class FACTOR >
std::pair<boost::shared_ptr<SymbolicConditional>, boost::shared_ptr<SymbolicFactor> > gtsam::internal::EliminateSymbolic ( const FactorGraph< FACTOR > &  factors,
const Ordering keys 
)

Implementation of dense elimination function for symbolic factors. This is a templated version for internally doing symbolic elimination on any factor.

Definition at line 39 of file SymbolicFactor-inst.h.

GTSAM_EXPORT boost::weak_ptr<TimingOutline> gtsam::internal::gCurrentTimer ( gTimingRoot  )
GTSAM_EXPORT size_t gtsam::internal::getTicTocID ( const char *  descriptionC)

Definition at line 218 of file timing.cpp.

GTSAM_EXPORT boost::shared_ptr<TimingOutline> gtsam::internal::gTimingRoot ( new   TimingOutline"Total", getTicTocID("Total"))
template<typename Derived >
void gtsam::internal::handleLeafCase ( const Eigen::MatrixBase< Derived > &  dTdA,
JacobianMap jacobians,
Key  key 
)

Handle Leaf Case: reverse AD ends here, by writing a matrix into Jacobians.

Definition at line 62 of file ExecutionTrace.h.

double gtsam::internal::logDeterminant ( const GaussianBayesTreeClique::shared_ptr clique,
double &  parentSum 
)

Definition at line 38 of file GaussianBayesTree.cpp.

template<class BAYESTREE >
double gtsam::internal::logDeterminant ( const typename BAYESTREE::sharedClique &  clique)

Definition at line 42 of file GaussianBayesTree-inl.h.

constexpr int gtsam::internal::NSquaredSO ( int  N)

Definition at line 42 of file SOn.h.

template<class BAYESTREE >
void gtsam::internal::optimizeInPlace ( const typename BAYESTREE::sharedClique &  clique,
VectorValues result 
)

Definition at line 31 of file GaussianBayesTree-inl.h.

static void gtsam::internal::optimizeInPlace ( const ISAM2::sharedClique clique,
VectorValues result 
)
inlinestatic

Definition at line 36 of file ISAM2-impl.cpp.

Point3 gtsam::internal::position ( const NavState X,
OptionalJacobian< 3, 9 >  H 
)

Definition at line 25 of file navigation/expressions.h.

template<class T , class A >
static void gtsam::internal::PrintJacobianAndTrace ( const std::string &  indent,
const typename Jacobian< T, A >::type dTdA,
const ExecutionTrace< A trace 
)
static

Definition at line 218 of file ExpressionNode.h.

template<class CAMERA , class POINT >
Point2 gtsam::internal::project4 ( const CAMERA &  camera,
const POINT &  p,
OptionalJacobian< 2, CAMERA::dimension >  Dcam,
OptionalJacobian< 2, FixedDimension< POINT >::value >  Dpoint 
)

Definition at line 97 of file slam/expressions.h.

template<class CALIBRATION , class POINT >
Point2 gtsam::internal::project6 ( const Pose3 x,
const Point3 p,
const Cal3_S2 K,
OptionalJacobian< 2, 6 >  Dpose,
OptionalJacobian< 2, 3 >  Dpoint,
OptionalJacobian< 2, 5 >  Dcal 
)
inline

Definition at line 111 of file slam/expressions.h.

Rot3 gtsam::internal::rotation ( const Pose3 pose,
OptionalJacobian< 3, 6 >  H 
)
inline

Definition at line 53 of file slam/expressions.h.

bool gtsam::internal::structureCompareOp ( const boost::tuple< VectorValues::value_type, VectorValues::value_type > &  vv)

Definition at line 213 of file VectorValues.cpp.

template<typename T >
bool gtsam::internal::testExpressionJacobians ( const std::string &  name_,
const gtsam::Expression< T > &  expression,
const gtsam::Values values,
double  nd_step,
double  tolerance 
)

Definition at line 31 of file expressionTesting.h.

bool gtsam::internal::testFactorJacobians ( const std::string &  name_,
const NoiseModelFactor factor,
const gtsam::Values values,
double  delta,
double  tolerance 
)

Definition at line 75 of file factorTesting.h.

GTSAM_EXPORT void gtsam::internal::tic ( size_t  id,
const char *  labelC 
)

Definition at line 237 of file timing.cpp.

GTSAM_EXPORT void gtsam::internal::toc ( size_t  id,
const char *  label 
)

Definition at line 246 of file timing.cpp.

template<typename T >
T& gtsam::internal::upAlign ( T value,
unsigned  requiredAlignment = TraceAlignment 
)

Definition at line 37 of file ExpressionNode.h.

template<typename T >
T gtsam::internal::upAligned ( T  value,
unsigned  requiredAlignment = TraceAlignment 
)

Definition at line 50 of file ExpressionNode.h.

void gtsam::internal::updateRgProd ( const ISAM2::sharedClique clique,
const KeySet replacedKeys,
const VectorValues grad,
VectorValues RgProd,
size_t varsUpdated 
)

Definition at line 80 of file ISAM2-impl.cpp.

Velocity3 gtsam::internal::velocity ( const NavState X,
OptionalJacobian< 3, 9 >  H 
)

Definition at line 28 of file navigation/expressions.h.

Variable Documentation

const int gtsam::internal::CallRecordMaxVirtualStaticRows = 5

CallRecordMaxVirtualStaticRows tells which separate virtual reverseAD with specific static rows (1..CallRecordMaxVirtualStaticRows) methods are part of the CallRecord interface. It is used to keep the testCallRecord unit test in sync.

Definition at line 133 of file CallRecord.h.

GTSAM_EXTERN_EXPORT boost::weak_ptr<TimingOutline> gtsam::internal::gCurrentTimer

Definition at line 220 of file timing.h.

GTSAM_EXTERN_EXPORT boost::shared_ptr<TimingOutline> gtsam::internal::gTimingRoot

Definition at line 219 of file timing.h.

const unsigned gtsam::internal::TraceAlignment = 32
static

Storage type for the execution trace. It enforces the proper alignment in a portable way. Provide a traceSize() sized array of this type to traceExecution as traceStorage.

Definition at line 38 of file ExecutionTrace.h.



gtsam
Author(s):
autogenerated on Sat May 8 2021 02:58:37