aligator  0.6.1
A primal-dual augmented Lagrangian-type solver for nonlinear trajectory optimization.
Loading...
Searching...
No Matches
aligator::python Namespace Reference

The Python bindings. More...

Classes

struct  BlkMatrixPythonVisitor
 
struct  CallbackWrapper
 
struct  ClonePythonVisitor
 
struct  ContinousDataWrapper
 
struct  CopyableVisitor
 
struct  CostDataWrapper
 
struct  CreateDataPolymorphicPythonVisitor
 
struct  CreateDataPythonVisitor
 
struct  ExplicitDataWrapper
 
struct  FrameAPIVisitor
 
struct  FunctionDataWrapper
 Required trampoline class. More...
 
struct  LinFunctionCompositionVisitor
 
struct  PrintableVisitor
 
struct  PrintAddressVisitor
 
struct  PyContinuousDynamics
 
struct  PyODEAbstract
 
struct  SlicingVisitor
 
struct  SolverVisitor
 

Typedefs

using QuadraticCost = QuadraticCostTpl<Scalar>
 
using CostPtr = shared_ptr<CostAbstract>
 
using FunctionPtr = shared_ptr<StageFunction>
 
using StateErrorResidual = StateErrorResidualTpl<Scalar>
 
using ControlErrorResidual = ControlErrorResidualTpl<Scalar>
 
using QParams = QFunctionTpl<Scalar>
 
using VParams = ValueFunctionTpl<Scalar>
 
using lqr_t = gar::LQRProblemTpl<context::Scalar>
 
using cholmod_solver_t = gar::CholmodLqSolver<context::Scalar>
 
using riccati_base_t = RiccatiSolverBase<Scalar>
 
using knot_t = LQRKnotTpl<context::Scalar>
 
using RowMatrixXs = Eigen::Transpose<MatrixXs>::PlainMatrix
 
using knot_vec_t = lqr_t::KnotVector
 
using prox_riccati_t = ProximalRiccatiSolver<Scalar>
 
using stage_factor_t = StageFactor<Scalar>
 
using ContactMap = ContactMapTpl<Scalar>
 
using ManifoldPtr = shared_ptr<Manifold>
 
using CentroidalFwdDynamics = CentroidalFwdDynamicsTpl<Scalar>
 
using ContinuousCentroidalFwdDynamics
 
using Vector3s = typename math_types<Scalar>::Vector3s
 
using DirectSumCost = DirectSumCostTpl<Scalar>
 
using DirectSumExplicitDynamics = DirectSumExplicitDynamicsTpl<Scalar>
 

Functions

void exposeCrocoddylCompat ()
 
template<class C , class MatrixType >
bp::object make_getter_eigen_matrix (MatrixType C::*v)
 Create a getter for Eigen::Matrix type objects which returns an Eigen::Ref.
 
template<class C , class MatrixType , class Policies >
bp::object make_setter_eigen_matrix (MatrixType C::*v, Policies const &policies)
 
template<class C , class MatrixType >
bp::object make_setter_eigen_matrix (MatrixType C::*v)
 
bp::arg operator""_a (const char *argname, std::size_t)
 User-defined literal for defining boost::python::arg.
 
void exposeGAR ()
 Expose GAR module.
 
void exposeFunctions ()
 Expose stagewise function classes.
 
void exposeCosts ()
 Expose cost functions.
 
void exposeConstraint ()
 Expose constraints.
 
void exposeStage ()
 Expose StageModel and StageData.
 
void exposeProblem ()
 Expose TrajOptProblem.
 
void exposeDynamics ()
 Expose discrete dynamics.
 
void exposeContinuousDynamics ()
 Expose continuous dynamics.
 
void exposeIntegrators ()
 Expose numerical integrators.
 
void exposeSolvers ()
 Expose solvers.
 
void exposeCallbacks ()
 Expose solver callbacks.
 
void exposeAutodiff ()
 Expose autodiff helpers.
 
void exposeUtils ()
 
void exposeFilter ()
 
template<typename T >
bool register_enum_symlink (bool export_values)
 
void exposeHistoryCallback ()
 
context::StageConstraintmake_constraint_wrap (const shared_ptr< context::StageFunction > &f, const shared_ptr< context::ConstraintSet > &c)
 
void exposeQuadCost ()
 
void exposeComposites ()
 Composite cost functions.
 
void exposeContactMap ()
 Centroidal cost functions.
 
void exposeCentroidalFunctions ()
 
void exposeCostStack ()
 fwd-declare exposeCostStack()
 
void exposeCostAbstract ()
 
void exposeCostOps ()
 
void exposeFunctionBase ()
 
void exposeUnaryFunctions ()
 Expose the UnaryFunction type and its member function overloads.
 
void exposeFunctionExpressions ()
 
void exposeFDDP ()
 
void exposeProxDDP ()
 
void exposeSolverCommon ()
 Expose base solver elements.
 
void exposeCholmodSolver ()
 
void exposeDenseSolver ()
 
bp::dict lqr_sol_initialize_wrap (const lqr_t &problem)
 
static void exposeBlockMatrices ()
 
void exposeParallelSolver ()
 
void exposeProxRiccati ()
 
void exposeODEs ()
 
void exposeExplicitDynDirectSum ()
 
void exposeDynamicsBase ()
 
void exposeExplicitDynamics ()
 
void exposeExplicitBase ()
 
void exposeLinearDiscreteDynamics ()
 
void exposeFreeFwdDynamics ()
 
template<typename Base >
void exposeSliceExpression (const char *name)
 
void exposeKinodynamics ()
 
static void exposeEnums ()
 
static void exposeContainers ()
 

Detailed Description

The Python bindings.

Typedef Documentation

◆ QuadraticCost

Definition at line 20 of file expose-costs.cpp.

◆ CostPtr

using aligator::python::CostPtr = shared_ptr<CostAbstract>

Definition at line 21 of file expose-costs.cpp.

◆ FunctionPtr

typedef shared_ptr< StageFunction > aligator::python::FunctionPtr = shared_ptr<StageFunction>

Definition at line 23 of file expose-functions.cpp.

◆ StateErrorResidual

◆ ControlErrorResidual

◆ QParams

Definition at line 9 of file expose-solver-fddp.cpp.

◆ VParams

Definition at line 10 of file expose-solver-fddp.cpp.

◆ lqr_t

◆ cholmod_solver_t

using aligator::python::cholmod_solver_t = gar::CholmodLqSolver<context::Scalar>

Definition at line 7 of file expose-cholmod-solver.cpp.

◆ riccati_base_t

Definition at line 9 of file expose-dense.cpp.

◆ knot_t

◆ RowMatrixXs

using aligator::python::RowMatrixXs = Eigen::Transpose<MatrixXs>::PlainMatrix

Definition at line 22 of file expose-gar.cpp.

◆ knot_vec_t

Definition at line 25 of file expose-gar.cpp.

◆ prox_riccati_t

◆ stage_factor_t

Definition at line 9 of file expose-prox-riccati.cpp.

◆ ContactMap

Definition at line 22 of file expose-centroidal.cpp.

◆ ManifoldPtr

typedef shared_ptr< context::Manifold > aligator::python::ManifoldPtr = shared_ptr<Manifold>

Definition at line 18 of file expose-composite-costs.cpp.

◆ CentroidalFwdDynamics

using aligator::python::CentroidalFwdDynamics = CentroidalFwdDynamicsTpl<Scalar>

Definition at line 22 of file expose-continuous-dynamics.cpp.

◆ ContinuousCentroidalFwdDynamics

Initial value:
ContinuousCentroidalFwdDynamicsTpl<Scalar>

Definition at line 23 of file expose-continuous-dynamics.cpp.

◆ Vector3s

using aligator::python::Vector3s = typename math_types<Scalar>::Vector3s

Definition at line 25 of file expose-continuous-dynamics.cpp.

◆ DirectSumCost

Definition at line 13 of file expose-cost-ops.cpp.

◆ DirectSumExplicitDynamics

Function Documentation

◆ exposeCrocoddylCompat()

void aligator::python::exposeCrocoddylCompat ( )

◆ make_getter_eigen_matrix()

template<class C , class MatrixType >
bp::object aligator::python::make_getter_eigen_matrix ( MatrixType C::* v)

Create a getter for Eigen::Matrix type objects which returns an Eigen::Ref.

See also
boost/python/data_member.hpp (make_getter(D C::*pm, ...))

Definition at line 45 of file eigen-member.hpp.

◆ make_setter_eigen_matrix() [1/2]

template<class C , class MatrixType , class Policies >
bp::object aligator::python::make_setter_eigen_matrix ( MatrixType C::* v,
Policies const & policies )

Definition at line 55 of file eigen-member.hpp.

◆ make_setter_eigen_matrix() [2/2]

template<class C , class MatrixType >
bp::object aligator::python::make_setter_eigen_matrix ( MatrixType C::* v)

Definition at line 64 of file eigen-member.hpp.

◆ operator""_a()

bp::arg aligator::python::operator""_a ( const char * argname,
std::size_t  )
inline

User-defined literal for defining boost::python::arg.

Definition at line 16 of file fwd.hpp.

◆ exposeGAR()

void aligator::python::exposeGAR ( )

Expose GAR module.

Definition at line 65 of file expose-gar.cpp.

◆ exposeFunctions()

void aligator::python::exposeFunctions ( )

Expose stagewise function classes.

Definition at line 139 of file expose-functions.cpp.

◆ exposeCosts()

void aligator::python::exposeCosts ( )

Expose cost functions.

Definition at line 132 of file expose-costs.cpp.

◆ exposeConstraint()

void aligator::python::exposeConstraint ( )

Expose constraints.

Definition at line 15 of file expose-constraint.cpp.

◆ exposeStage()

void aligator::python::exposeStage ( )

Expose StageModel and StageData.

Definition at line 15 of file expose-stage.cpp.

◆ exposeProblem()

void aligator::python::exposeProblem ( )

Expose TrajOptProblem.

Definition at line 10 of file expose-problem.cpp.

◆ exposeDynamics()

void aligator::python::exposeDynamics ( )

Expose discrete dynamics.

Definition at line 16 of file expose-dynamics.cpp.

◆ exposeContinuousDynamics()

void aligator::python::exposeContinuousDynamics ( )

Expose continuous dynamics.

Definition at line 35 of file expose-continuous-dynamics.cpp.

◆ exposeIntegrators()

void aligator::python::exposeIntegrators ( )

Expose numerical integrators.

Definition at line 15 of file expose-integrators.cpp.

◆ exposeSolvers()

void aligator::python::exposeSolvers ( )

Expose solvers.

Definition at line 55 of file expose-solvers-base.cpp.

◆ exposeCallbacks()

void aligator::python::exposeCallbacks ( )

Expose solver callbacks.

Definition at line 36 of file expose-callbacks.cpp.

◆ exposeAutodiff()

void aligator::python::exposeAutodiff ( )

Expose autodiff helpers.

Expose finite difference helpers.

Definition at line 9 of file expose-autodiff.cpp.

◆ exposeUtils()

void aligator::python::exposeUtils ( )

Definition at line 7 of file expose-utils.cpp.

◆ exposeFilter()

void aligator::python::exposeFilter ( )

Definition at line 11 of file expose-filter.cpp.

◆ register_enum_symlink()

template<typename T >
bool aligator::python::register_enum_symlink ( bool export_values)

Definition at line 14 of file utils.hpp.

◆ exposeHistoryCallback()

void aligator::python::exposeHistoryCallback ( )

Definition at line 10 of file expose-callbacks.cpp.

◆ make_constraint_wrap()

context::StageConstraint * aligator::python::make_constraint_wrap ( const shared_ptr< context::StageFunction > & f,
const shared_ptr< context::ConstraintSet > & c )

Definition at line 10 of file expose-constraint.cpp.

◆ exposeQuadCost()

void aligator::python::exposeQuadCost ( )

Definition at line 27 of file expose-costs.cpp.

◆ exposeComposites()

void aligator::python::exposeComposites ( )

Composite cost functions.

Definition at line 20 of file expose-composite-costs.cpp.

◆ exposeContactMap()

void aligator::python::exposeContactMap ( )

Centroidal cost functions.

Definition at line 24 of file expose-centroidal.cpp.

◆ exposeCentroidalFunctions()

void aligator::python::exposeCentroidalFunctions ( )

Definition at line 46 of file expose-centroidal.cpp.

◆ exposeCostStack()

void aligator::python::exposeCostStack ( )

fwd-declare exposeCostStack()

Definition at line 13 of file expose-cost-stack.cpp.

◆ exposeCostAbstract()

void aligator::python::exposeCostAbstract ( )

Definition at line 75 of file expose-costs.cpp.

◆ exposeCostOps()

void aligator::python::exposeCostOps ( )

Definition at line 15 of file expose-cost-ops.cpp.

◆ exposeFunctionBase()

void aligator::python::exposeFunctionBase ( )

Definition at line 32 of file expose-functions.cpp.

◆ exposeUnaryFunctions()

void aligator::python::exposeUnaryFunctions ( )

Expose the UnaryFunction type and its member function overloads.

Definition at line 17 of file expose-unary-functions.cpp.

◆ exposeFunctionExpressions()

void aligator::python::exposeFunctionExpressions ( )

FUNCTION LINEAR COMPOSE

FUNCTION LINEAR COMPOSE

Definition at line 68 of file expose-function-ops.cpp.

◆ exposeFDDP()

void aligator::python::exposeFDDP ( )

Definition at line 16 of file expose-solver-fddp.cpp.

◆ exposeProxDDP()

void aligator::python::exposeProxDDP ( )

Definition at line 16 of file expose-solver-prox.cpp.

◆ exposeSolverCommon()

void aligator::python::exposeSolverCommon ( )

Expose base solver elements.

Definition at line 16 of file expose-solvers-base.cpp.

◆ exposeCholmodSolver()

void aligator::python::exposeCholmodSolver ( )

Definition at line 9 of file expose-cholmod-solver.cpp.

◆ exposeDenseSolver()

void aligator::python::exposeDenseSolver ( )

Definition at line 12 of file expose-dense.cpp.

◆ lqr_sol_initialize_wrap()

bp::dict aligator::python::lqr_sol_initialize_wrap ( const lqr_t & problem)

Definition at line 27 of file expose-gar.cpp.

◆ exposeBlockMatrices()

static void aligator::python::exposeBlockMatrices ( )
static

Definition at line 38 of file expose-gar.cpp.

◆ exposeParallelSolver()

void aligator::python::exposeParallelSolver ( )

Definition at line 16 of file expose-parallel.cpp.

◆ exposeProxRiccati()

void aligator::python::exposeProxRiccati ( )

Definition at line 13 of file expose-prox-riccati.cpp.

◆ exposeODEs()

void aligator::python::exposeODEs ( )

Definition at line 18 of file expose-ode.cpp.

◆ exposeExplicitDynDirectSum()

void aligator::python::exposeExplicitDynDirectSum ( )

Definition at line 14 of file expose-direct-sum.cpp.

◆ exposeDynamicsBase()

void aligator::python::exposeDynamicsBase ( )

Definition at line 25 of file expose-dynamics.cpp.

◆ exposeExplicitDynamics()

void aligator::python::exposeExplicitDynamics ( )

Definition at line 25 of file expose-explicit-dynamics.cpp.

◆ exposeExplicitBase()

void aligator::python::exposeExplicitBase ( )

Definition at line 36 of file expose-explicit-dynamics.cpp.

◆ exposeLinearDiscreteDynamics()

void aligator::python::exposeLinearDiscreteDynamics ( )

Definition at line 73 of file expose-explicit-dynamics.cpp.

◆ exposeFreeFwdDynamics()

void aligator::python::exposeFreeFwdDynamics ( )

Definition at line 8 of file expose-freefwd.cpp.

◆ exposeSliceExpression()

template<typename Base >
void aligator::python::exposeSliceExpression ( const char * name)

Definition at line 19 of file expose-function-ops.cpp.

◆ exposeKinodynamics()

void aligator::python::exposeKinodynamics ( )

Definition at line 11 of file expose-kinodynamics.cpp.

◆ exposeEnums()

static void aligator::python::exposeEnums ( )
static

Definition at line 18 of file module.cpp.

◆ exposeContainers()

static void aligator::python::exposeContainers ( )
static

Definition at line 50 of file module.cpp.