Classes | Typedefs | Functions
tsid::python Namespace Reference

Classes

struct  ConstPythonVisitor
 
struct  ConstraintEqPythonVisitor
 
struct  ConstraintIneqPythonVisitor
 
class  ConstraintLevels
 
struct  ConstraintPythonVisitor
 
struct  Contact6DPythonVisitor
 
struct  ContactPointPythonVisitor
 
struct  ContactTwoFramePositionsPythonVisitor
 
struct  ContactTwoFramesPythonVisitor
 
class  HQPDatas
 
struct  HQPOutputPythonVisitor
 
struct  HQPPythonVisitor
 
struct  InvDynPythonVisitor
 
struct  Measured6dWrenchPythonVisitor
 
struct  RobotPythonVisitor
 
struct  SolverHQuadProgPythonVisitor
 
struct  SolverOSQPPythonVisitor
 
struct  SolverProxQPPythonVisitor
 
struct  TaskActuationBoundsPythonVisitor
 
struct  TaskActuationEqualityPythonVisitor
 
struct  TaskAMEqualityPythonVisitor
 
struct  TaskCOMEqualityPythonVisitor
 
struct  TaskContactForceEqualityPythonVisitor
 
struct  TaskCOPEqualityPythonVisitor
 
struct  TaskJointBoundsPythonVisitor
 
struct  TaskJointPosturePythonVisitor
 
struct  TaskJointPosVelAccBoundsPythonVisitor
 
struct  TaskSE3EqualityPythonVisitor
 
struct  TaskTwoFramesEqualityPythonVisitor
 
struct  TrajectoryEuclidianConstantPythonVisitor
 
struct  TrajectorySamplePythonVisitor
 
struct  TrajectorySE3ConstantPythonVisitor
 

Typedefs

typedef solvers::ConstraintLevel ConstraintLevel
 
typedef math::ConstRefVector ConstRefVector
 
typedef solvers::HQPData HQPData
 
typedef pinocchio::SE3 SE3
 

Functions

void exposeConstraintBound ()
 
void exposeConstraintEquality ()
 
void exposeConstraintInequality ()
 
void exposeConstraintLevel ()
 
void exposeConstraints ()
 
void exposeContact ()
 
void exposeContact6d ()
 
void exposeContactPoint ()
 
void exposeContactTwoFramePositions ()
 
void exposeFormulations ()
 
void exposeHQPData ()
 
void exposeHQPOutput ()
 
void exposeInverseDynamicsFormulationAccForce ()
 
void exposeMathUtils ()
 
void exposeMeasured6dWrench ()
 
void exposeRobots ()
 
void exposeRobotWrapper ()
 
void exposeSolverHQuadProg ()
 
void exposeSolverOSQP ()
 
void exposeSolverProxQP ()
 
void exposeSolvers ()
 
void exposeTaskActuationBounds ()
 
void exposeTaskActuationEquality ()
 
void exposeTaskAMEquality ()
 
void exposeTaskComEquality ()
 
void exposeTaskContactForceEquality ()
 
void exposeTaskCopEquality ()
 
void exposeTaskJointBounds ()
 
void exposeTaskJointPosture ()
 
void exposeTaskJointPosVelAccBounds ()
 
void exposeTasks ()
 
void exposeTaskSE3Equality ()
 
void exposeTaskTwoFramesEquality ()
 
void exposeTrajectories ()
 
void exposeTrajectoryEuclidianConstant ()
 
void exposeTrajectorySample ()
 
void exposeTrajectorySE3Constant ()
 
static math::Vector SE3ToVector_1 (const pinocchio::SE3 &M)
 
static pinocchio::SE3 vectorToSE3_1 (math::RefVector vec)
 

Typedef Documentation

◆ ConstraintLevel

Definition at line 31 of file container.hpp.

◆ ConstRefVector

typedef math::ConstRefVector tsid::python::ConstRefVector

◆ HQPData

Definition at line 32 of file container.hpp.

◆ SE3

Function Documentation

◆ exposeConstraintBound()

void tsid::python::exposeConstraintBound ( )

◆ exposeConstraintEquality()

void tsid::python::exposeConstraintEquality ( )

◆ exposeConstraintInequality()

void tsid::python::exposeConstraintInequality ( )

◆ exposeConstraintLevel()

void tsid::python::exposeConstraintLevel ( )

Definition at line 23 of file HQPData.cpp.

◆ exposeConstraints()

void tsid::python::exposeConstraints ( )
inline

Definition at line 29 of file expose-constraints.hpp.

◆ exposeContact()

void tsid::python::exposeContact ( )
inline

Definition at line 33 of file expose-contact.hpp.

◆ exposeContact6d()

void tsid::python::exposeContact6d ( )

Definition at line 23 of file bindings/python/contacts/contact-6d.cpp.

◆ exposeContactPoint()

void tsid::python::exposeContactPoint ( )

Definition at line 23 of file bindings/python/contacts/contact-point.cpp.

◆ exposeContactTwoFramePositions()

void tsid::python::exposeContactTwoFramePositions ( )

◆ exposeFormulations()

void tsid::python::exposeFormulations ( )
inline

Definition at line 27 of file expose-formulations.hpp.

◆ exposeHQPData()

void tsid::python::exposeHQPData ( )

Definition at line 26 of file HQPData.cpp.

◆ exposeHQPOutput()

void tsid::python::exposeHQPOutput ( )

Definition at line 23 of file HQPOutput.cpp.

◆ exposeInverseDynamicsFormulationAccForce()

void tsid::python::exposeInverseDynamicsFormulationAccForce ( )

Definition at line 23 of file formulation.cpp.

◆ exposeMathUtils()

void tsid::python::exposeMathUtils ( )

Definition at line 37 of file bindings/python/math/utils.cpp.

◆ exposeMeasured6dWrench()

void tsid::python::exposeMeasured6dWrench ( )

◆ exposeRobots()

void tsid::python::exposeRobots ( )
inline

Definition at line 26 of file expose-robots.hpp.

◆ exposeRobotWrapper()

void tsid::python::exposeRobotWrapper ( )

Definition at line 23 of file bindings/python/robots/robot-wrapper.cpp.

◆ exposeSolverHQuadProg()

void tsid::python::exposeSolverHQuadProg ( )

◆ exposeSolverOSQP()

void tsid::python::exposeSolverOSQP ( )

◆ exposeSolverProxQP()

void tsid::python::exposeSolverProxQP ( )

◆ exposeSolvers()

void tsid::python::exposeSolvers ( )
inline

Definition at line 38 of file expose-solvers.hpp.

◆ exposeTaskActuationBounds()

void tsid::python::exposeTaskActuationBounds ( )

◆ exposeTaskActuationEquality()

void tsid::python::exposeTaskActuationEquality ( )

◆ exposeTaskAMEquality()

void tsid::python::exposeTaskAMEquality ( )

Definition at line 23 of file task-am-equality.cpp.

◆ exposeTaskComEquality()

void tsid::python::exposeTaskComEquality ( )

Definition at line 23 of file bindings/python/tasks/task-com-equality.cpp.

◆ exposeTaskContactForceEquality()

void tsid::python::exposeTaskContactForceEquality ( )

◆ exposeTaskCopEquality()

void tsid::python::exposeTaskCopEquality ( )

Definition at line 23 of file bindings/python/tasks/task-cop-equality.cpp.

◆ exposeTaskJointBounds()

void tsid::python::exposeTaskJointBounds ( )

Definition at line 23 of file bindings/python/tasks/task-joint-bounds.cpp.

◆ exposeTaskJointPosture()

void tsid::python::exposeTaskJointPosture ( )

Definition at line 23 of file bindings/python/tasks/task-joint-posture.cpp.

◆ exposeTaskJointPosVelAccBounds()

void tsid::python::exposeTaskJointPosVelAccBounds ( )

◆ exposeTasks()

void tsid::python::exposeTasks ( )
inline

Definition at line 45 of file expose-tasks.hpp.

◆ exposeTaskSE3Equality()

void tsid::python::exposeTaskSE3Equality ( )

Definition at line 23 of file bindings/python/tasks/task-se3-equality.cpp.

◆ exposeTaskTwoFramesEquality()

void tsid::python::exposeTaskTwoFramesEquality ( )

◆ exposeTrajectories()

void tsid::python::exposeTrajectories ( )
inline

Definition at line 31 of file expose-trajectories.hpp.

◆ exposeTrajectoryEuclidianConstant()

void tsid::python::exposeTrajectoryEuclidianConstant ( )

◆ exposeTrajectorySample()

void tsid::python::exposeTrajectorySample ( )

Definition at line 23 of file trajectory-base.cpp.

◆ exposeTrajectorySE3Constant()

void tsid::python::exposeTrajectorySE3Constant ( )

◆ SE3ToVector_1()

static math::Vector tsid::python::SE3ToVector_1 ( const pinocchio::SE3 M)
static

Definition at line 25 of file bindings/python/math/utils.cpp.

◆ vectorToSE3_1()

static pinocchio::SE3 tsid::python::vectorToSE3_1 ( math::RefVector  vec)
static

Definition at line 31 of file bindings/python/math/utils.cpp.



tsid
Author(s): Andrea Del Prete, Justin Carpentier
autogenerated on Sat May 3 2025 02:48:17