wbc
|
Namespaces | |
namespace | types |
Classes | |
class | AccelerationSceneReducedTSID |
Acceleration-based implementation of the WBC Scene. It sets up and solves the following problem: More... | |
class | AccelerationSceneTSID |
Acceleration-based implementation of the WBC Scene. It sets up and solves the following problem: More... | |
class | CartesianPotentialFieldsController |
The PotentialFieldsController class implements a multi potential field controller in Cartesian space. More... | |
class | CoMAccelerationTask |
Implementation of a CoM velocity task. More... | |
class | CoMVelocityTask |
Implementation of a CoM velocity task. More... | |
class | Constraint |
Abstract 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. More... | |
class | ContactForceTask |
class | ContactsAccelerationConstraint |
Abstract class to represent a generic hard constraint for a WBC optimization problem. More... | |
class | ContactsFrictionPointConstraint |
class | ContactsFrictionSurfaceConstraint |
class | ContactsVelocityConstraint |
Abstract class to represent a generic hard constraint for a WBC optimization problem. More... | |
class | EffortLimitsAccelerationConstraint |
Effort 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. More... | |
class | EiquadprogSolver |
The EiquadprogSolver class is a wrapper for the qp-solver eiquadprog (see https://github.com/stack-of-tasks/eiquadprog). It solves problems of shape: More... | |
struct | HierarchicalQP |
Describes a hierarchy of quadratic programs. More... | |
class | HPIPMSolver |
class | JointAccelerationTask |
Implementation of a Joint velocity task. More... | |
class | JointIntegrator |
The JointIntegrator class implements different numerical integrators. More... | |
class | JointLimitAvoidanceController |
class | JointLimitsAccelerationConstraint |
Abstract class to represent a generic hard constraint for a WBC optimization problem. More... | |
class | JointLimitsVelocityConstraint |
Abstract class to represent a generic hard constraint for a WBC optimization problem. More... | |
class | JointPosPDController |
The JointPosPDController class implements a PD Controller with feed forward on the base-Joints type. The following control schemes are available: More... | |
class | JointVelocityTask |
Implementation of a Joint velocity task. More... | |
class | OsqpSolver |
The OsqpSolver solves convex quadratic programs (QPs) of the form. More... | |
class | PIDController |
The PIDController class implements an n-dimensional PID controller. More... | |
class | PIDCtrlParams |
class | PlanarPotentialField |
Planar Potential field. The gradient will be constant on planes parallel to the plane defined by x0 (origin) and n (surface normal) More... | |
class | PluginLoader |
Helper class to load the robot model, solver and scene plugins. More... | |
class | PotentialField |
Base class for potential fields. More... | |
struct | PotentialFieldInfo |
class | PotentialFieldsController |
Eigen class for potential field controllers. More... | |
class | ProxQPSolver |
The ProxQPSolver class is a wrapper for the qp-solver prox-qp (see https://github.com/Simple-Robotics/proxsuite). It solves problems of shape: More... | |
class | QPOASESSolver |
The QPOASESSolver class is a wrapper for the qp-solver qpoases (see https://www.coin-or.org/qpOASES/doc/3.0/manual.pdf). It solves problems of shape: More... | |
class | QPSolver |
Base class for all QP solvers. More... | |
struct | QPSolverFactory |
struct | QPSolverRegistry |
class | QPSwiftSolver |
struct | QuadraticProgram |
Describes a quadratic program of the form. More... | |
class | RadialPotentialField |
Radial Potential field. The computed gradient will be constant on volumnes with constant radius around the center of the potential field: More... | |
class | RigidbodyDynamicsConstraint |
Abstract class to represent a generic hard constraint for a WBC optimization problem. More... | |
class | RobotModel |
Interface for all robot models. This has to provide all kinematics and dynamics information that is required for WBC. Conventions and usage: More... | |
struct | RobotModelConfig |
Robot Model configuration class, containts information like urdf file, type of robot model to be loaded, etc. More... | |
struct | RobotModelFactory |
class | RobotModelHyrodyn |
class | RobotModelPinocchio |
class | RobotModelRBDL |
struct | RobotModelRegistry |
class | Scene |
Base class for all wbc scenes. More... | |
struct | SceneFactory |
struct | SceneRegistry |
class | SpatialAccelerationTask |
Implementation of a Cartesian acceleration task. More... | |
class | SpatialVelocityTask |
Implementation of a Cartesian velocity task. More... | |
class | Task |
Abstract class to represent a generic task for a WBC optimization problem. More... | |
class | TaskConfig |
Defines a task in the whole body control problem. More... | |
class | URDFTools |
class | VelocitySceneQP |
Velocity-based implementation of the WBC Scene. It sets up and solves the following problem: More... | |
class | WrenchPIDController |
CartesianForcePIDController implements a PID Controller on a Wrench data type. More... | |
Enumerations | |
enum | TaskType { unset = -1 , spatial_velocity , spatial_acceleration , com_velocity , com_acceleration , joint_velocity , joint_acceleration , contact_force } |
Functions | |
template<typename T> | |
QPSolver * | createT () |
template<typename T> | |
RobotModel * | createT () |
template<typename T, typename RobotModelPtr, typename QPSolverPtr> | |
Scene * | createT (RobotModelPtr robot_model, QPSolverPtr solver, const double dt) |
void | printRbs (types::RigidBodyState rbs) |
types::JointState | makeRandomJointState (uint n) |
types::RigidBodyState | makeRandomFloatingBaseState () |
void | testFK (RobotModelPtr robot_model, const string &tip_frame, bool verbose) |
void | testSpaceJacobian (RobotModelPtr robot_model, const string &tip_frame, bool verbose) |
void | testBodyJacobian (RobotModelPtr robot_model, const string &tip_frame, bool verbose) |
void | testCoMJacobian (RobotModelPtr robot_model, bool verbose) |
void | testInverseDynamics (RobotModelPtr robot_model, bool verbose) |
void | testFK (RobotModelPtr robot_model, const std::string &tip_frame, bool verbose=false) |
void | testSpaceJacobian (RobotModelPtr robot_model, const std::string &tip_frame, bool verbose=false) |
void | testBodyJacobian (RobotModelPtr robot_model, const std::string &tip_frame, bool verbose=false) |
void | testDynamics (RobotModelPtr robot_model, bool verbose) |
typedef std::shared_ptr<CoMAccelerationTask> wbc::CoMAccelerationTaskPtr |
typedef std::shared_ptr<CoMVelocityTask> wbc::CoMVelocityTaskPtr |
typedef std::shared_ptr<Constraint> wbc::ConstraintPtr |
typedef std::shared_ptr<ContactForceTask> wbc::ContactForceTaskPtr |
typedef std::shared_ptr<ContactsAccelerationConstraint> wbc::ContactsAccelerationConstraintPtr |
typedef std::shared_ptr<ContactsVelocityConstraint> wbc::ContactsVelocityConstraintPtr |
typedef std::shared_ptr<EffortLimitsAccelerationConstraint> wbc::EffortLimitsAccelerationConstraintPtr |
using wbc::JointAccelerationTaskPtr = std::shared_ptr<JointAccelerationTask> |
typedef std::shared_ptr<JointLimitsAccelerationConstraint> wbc::JointLimitsAccelerationConstraintPtr |
typedef std::shared_ptr<JointLimitsVelocityConstraint> wbc::JointLimitsVelocityConstraintPtr |
using wbc::JointPosPDControllerPtr = std::shared_ptr<JointPosPDController> |
typedef std::shared_ptr<JointVelocityTask> wbc::JointVelocityTaskPtr |
typedef std::shared_ptr<PlanarPotentialField> wbc::PlanarPotentialFieldPtr |
typedef std::shared_ptr<PotentialField> wbc::PotentialFieldPtr |
typedef std::shared_ptr<QPSolver> wbc::QPSolverPtr |
typedef std::shared_ptr<RigidbodyDynamicsConstraint> wbc::RigidbodyDynamicsConstraintPtr |
typedef std::shared_ptr<RobotModel> wbc::RobotModelPtr |
typedef std::shared_ptr<Scene> wbc::ScenePtr |
using wbc::SpatialAccelerationTaskPtr = std::shared_ptr<SpatialAccelerationTask> |
typedef std::shared_ptr<SpatialVelocityTask> wbc::SpatialVelocityTaskPtr |
using wbc::TaskPtr = std::shared_ptr<Task> |
enum wbc::TaskType |
QPSolver * wbc::createT | ( | ) |
RobotModel * wbc::createT | ( | ) |
Scene * wbc::createT | ( | RobotModelPtr | robot_model, |
QPSolverPtr | solver, | ||
const double | dt ) |
types::RigidBodyState wbc::makeRandomFloatingBaseState | ( | ) |
types::JointState wbc::makeRandomJointState | ( | uint | n | ) |
void wbc::printRbs | ( | types::RigidBodyState | rbs | ) |
void wbc::testBodyJacobian | ( | RobotModelPtr | robot_model, |
const std::string & | tip_frame, | ||
bool | verbose = false ) |
void wbc::testBodyJacobian | ( | RobotModelPtr | robot_model, |
const string & | tip_frame, | ||
bool | verbose ) |
void wbc::testCoMJacobian | ( | RobotModelPtr | robot_model, |
bool | verbose ) |
void wbc::testDynamics | ( | RobotModelPtr | robot_model, |
bool | verbose ) |
void wbc::testFK | ( | RobotModelPtr | robot_model, |
const std::string & | tip_frame, | ||
bool | verbose = false ) |
void wbc::testFK | ( | RobotModelPtr | robot_model, |
const string & | tip_frame, | ||
bool | verbose ) |
void wbc::testInverseDynamics | ( | RobotModelPtr | robot_model, |
bool | verbose ) |
void wbc::testSpaceJacobian | ( | RobotModelPtr | robot_model, |
const std::string & | tip_frame, | ||
bool | verbose = false ) |
void wbc::testSpaceJacobian | ( | RobotModelPtr | robot_model, |
const string & | tip_frame, | ||
bool | verbose ) |