11 #ifndef RDL_CONTACTS_H 12 #define RDL_CONTACTS_H 186 double normal_acceleration = 0.);
195 result.
bound =
false;
236 std::vector<unsigned int>
body;
276 Eigen::HouseholderQR<Math::MatrixNd>
GT_qr;
311 std::vector<Math::SpatialVector>
d_a;
315 std::vector<Math::SpatialMatrix>
d_IA;
318 std::vector<Math::SpatialVector>
d_U;
584 #endif // ifndef RDL_CONTACTS_H Math::VectorNd C
Workspace for the coriolis forces.
Math::SpatialForceV f_t
Workspace for the test forces.
Math::SpatialForceV f_ext_constraints
Workspace for the actual spatial forces.
std::vector< SpatialForce, Eigen::aligned_allocator< SpatialForce > > SpatialForceV
Math::VectorNd b
Workspace for the Lagrangian right-hand-side.
void clear()
Clears all variables in the constraint set.
Math::VectorNd a
Workspace for the accelerations of due to the test forces.
bool bound
Whether the constraint set was bound to a model (mandatory!).
ConstraintSet Copy()
Copies the constraints and resets its ConstraintSet::bound flag.
std::vector< std::string > name
void setSolver(Math::LinearSolver solver)
Specifies which method should be used for solving undelying linear systems.
Math::SpatialForceV d_pA
Workspace for the bias force due to the test force.
unsigned int addConstraint(unsigned int body_id, const Math::Vector3d &body_point, const Math::Vector3d &world_normal, const char *constraint_name=NULL, double normal_acceleration=0.)
Adds a constraint to the constraint set.
std::vector< Math::Vector3d > point
Math::MatrixNd A
Workspace for the Lagrangian left-hand-side matrix.
std::vector< Math::SpatialVector > d_U
Workspace when applying constraint forces.
Math::VectorNd acceleration
Math::VectorNd QDDot_t
Workspace for the test accelerations.
std::vector< Math::Vector3d > d_multdof3_u
LinearSolver
Available solver methods for the linear systems.
Structure that contains both constraint information and workspace memory.
Math::VectorNd gamma
Workspace of the lower part of b.
std::vector< unsigned int > body
std::vector< Math::Vector3d > point_accel_0
Workspace for the default point accelerations.
std::vector< Math::SpatialMatrix > d_IA
Workspace for the inertia when applying constraint forces.
Math::VectorNd QDDot_0
Workspace for the default accelerations.
Contains all information about the rigid body model.
bool bind(const Model &model)
Initializes and allocates memory for the constraint set.
Eigen::HouseholderQR< Math::MatrixNd > GT_qr
Workspace for the QR decomposition of the null-space method.
Math::MatrixNd K
Workspace for the Inverse Articulated-Body Inertia.
std::vector< Math::SpatialVector > d_a
Workspace for the acceleration due to the test force.
Math::LinearSolver linear_solver
Method that should be used to solve internal linear systems.
Namespace for all structures of the RobotDynamics library.
Math::VectorNd x
Workspace for the Lagrangian solution.
Math::MatrixNd H
Workspace for the joint space inertia matrix.
std::vector< Math::Vector3d > normal
size_t size() const
Returns the number of constraints.
Math::VectorNd d_d
Workspace when applying constraint forces.