wbc
Class Hierarchy
This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 12]
 Cwbc::ConstraintAbstract class to represent a generic hard (linear) constraint for a WBC optimization problem. the constraint belongs to one of three types: equality Ax = b inequality lb <= Ax <= ub bounds lb <= x <= ub
 Cwbc::ContactsAccelerationConstraintAbstract class to represent a generic hard constraint for a WBC optimization problem
 Cwbc::ContactsFrictionPointConstraint
 Cwbc::ContactsFrictionSurfaceConstraint
 Cwbc::ContactsVelocityConstraintAbstract class to represent a generic hard constraint for a WBC optimization problem
 Cwbc::EffortLimitsAccelerationConstraintEffort limits constraint for reduced TSID scene since torques are not part of qp, torque limits are enforced through acceleration and external forces limits using the linear dependecy given by the dynamic model
 Cwbc::JointLimitsAccelerationConstraintAbstract class to represent a generic hard constraint for a WBC optimization problem
 Cwbc::JointLimitsVelocityConstraintAbstract class to represent a generic hard constraint for a WBC optimization problem
 Cwbc::RigidbodyDynamicsConstraintAbstract class to represent a generic hard constraint for a WBC optimization problem
 Cwbc::types::ContactDescribes a rigid contact between a robot link and the environment. This can be either a point or surface contact
 Cwbc::HierarchicalQPDescribes a hierarchy of quadratic programs
 Cwbc::types::JointCommand
 Cwbc::JointIntegratorImplements different numerical integrators
 Cwbc::types::JointLimits
 Cwbc::JointPosPDControllerImplements a PD Controller with feed forward on the base-Joints type. The following control schemes are available:
 Cwbc::types::JointStateDescribes either the state or the command for a set of joints, i.e., its actual or target position, velocity, acceleration and effort
 Cwbc::types::Limits
 Clogger
 Cwbc::RobotModel::Matrix
 Cwbc::PIDControllerImplements an n-dimensional PID controller
 Cwbc::WrenchPIDControllerCartesianForcePIDController implements a PID Controller on a Wrench data type
 Cwbc::PIDCtrlParams
 Cwbc::PluginLoaderHelper class to load the robot model, solver and scene plugins
 Cwbc::RobotModel::Pose
 Cwbc::types::Pose
 Cwbc::PotentialFieldBase class for potential fields
 Cwbc::PlanarPotentialFieldPlanar Potential field. The gradient will be constant on planes parallel to the plane defined by x0 (origin) and n (surface normal)
 Cwbc::RadialPotentialFieldRadial Potential field. The computed gradient will be constant on volumnes with constant radius around the center of the potential field:
 Cwbc::PotentialFieldInfo
 Cwbc::PotentialFieldsControllerEigen class for potential field controllers
 Cwbc::CartesianPotentialFieldsControllerThe PotentialFieldsController class implements a multi potential field controller in Cartesian space
 Cwbc::JointLimitAvoidanceController
 Cwbc::QPSolverBase class for all QP solvers
 Cwbc::EiquadprogSolverWrapper for the qp-solver eiquadprog (see https://github.com/stack-of-tasks/eiquadprog). It solves problems of shape:
 Cwbc::HPIPMSolver
 Cwbc::OsqpSolverThe OsqpSolver solves convex quadratic programs (QPs) of the form
 Cwbc::ProxQPSolverWrapper for the qp-solver prox-qp (see https://github.com/Simple-Robotics/proxsuite). It solves problems of shape:
 Cwbc::QPOASESSolverWrapper for the qp-solver qpoases (see https://www.coin-or.org/qpOASES/doc/3.0/manual.pdf). It solves problems of shape:
 Cwbc::QPSwiftSolver
 Cwbc::QPSolverFactory
 Cwbc::QPSolverRegistry< wbc::EiquadprogSolver >
 Cwbc::QPSolverRegistry< wbc::HPIPMSolver >
 Cwbc::QPSolverRegistry< wbc::OsqpSolver >
 Cwbc::QPSolverRegistry< wbc::ProxQPSolver >
 Cwbc::QPSolverRegistry< wbc::QPOASESSolver >
 Cwbc::QPSolverRegistry< wbc::QPSwiftSolver >
 Cwbc::QPSolverRegistry< T >
 Cwbc::QuadraticProgramDescribes a quadratic program of the form
 Cwbc::RobotModel::RigidBodyState
 Cwbc::types::RigidBodyState
 Cwbc::RobotModelInterface for all robot models. This has to provide all kinematics and dynamics information that is required for WBC. Conventions and usage:
 Cwbc::RobotModelHyrodyn
 Cwbc::RobotModelPinocchio
 Cwbc::RobotModelRBDL
 Cwbc::RobotModelConfigRobot Model configuration class, containts information like urdf file, type of robot model to be loaded, etc
 Cwbc::RobotModelFactory
 Cwbc::RobotModelRegistry< wbc::RobotModelHyrodyn >
 Cwbc::RobotModelRegistry< wbc::RobotModelPinocchio >
 Cwbc::RobotModelRegistry< wbc::RobotModelRBDL >
 Cwbc::RobotModelRegistry< T >
 Cwbc::SceneBase class for all wbc scenes
 Cwbc::AccelerationSceneReducedTSIDAcceleration-based implementation of the WBC Scene. It sets up and solves the following problem:
 Cwbc::AccelerationSceneTSIDAcceleration-based implementation of the WBC Scene. It sets up and solves the following problem:
 Cwbc::VelocitySceneQPVelocity-based implementation of the WBC Scene. It sets up and solves the following problem:
 Cwbc::SceneFactory
 Cwbc::SceneRegistry< wbc::AccelerationSceneReducedTSID >
 Cwbc::SceneRegistry< wbc::AccelerationSceneTSID >
 Cwbc::SceneRegistry< wbc::VelocitySceneQP >
 Cwbc::SceneRegistry< T >
 Cwbc::RobotModel::SpatialAcceleration
 Cwbc::types::SpatialAcceleration
 Cwbc::TaskAbstract class to represent a generic task for a WBC optimization problem
 Cwbc::CoMAccelerationTaskImplementation of a CoM velocity task
 Cwbc::CoMVelocityTaskImplementation of a CoM velocity task
 Cwbc::ContactForceTask
 Cwbc::JointAccelerationTaskImplementation of a Joint velocity task
 Cwbc::JointVelocityTaskImplementation of a Joint velocity task
 Cwbc::SpatialAccelerationTaskImplementation of a Cartesian acceleration task
 Cwbc::SpatialVelocityTaskImplementation of a Cartesian velocity task
 Cwbc::TaskConfigDefines a task in the whole body control problem
 Cwbc::RobotModel::Twist
 Cwbc::types::Twist
 Cwbc::URDFTools
 Cwbc::RobotModel::Vector
 Cwbc::types::Wrench