29 m_constraint(name, 3, 3) {
56 n +=
cl->contact.n_force();
64 for (
auto&
cl : *m_contacts) {
65 unsigned int i =
cl->index;
71 for (
int j = 0; j < P.cols(); ++j) {
73 p_world = oMi.act(p_local);
76 M.middleCols(i + 3 * j, 3) = (p_world -
m_ref) * (
m_normal.transpose());
88 "The size of the reference needs to equal 3");
void setReference(const Vector3 &ref)
std::string m_contact_name
virtual const std::string & getAssociatedContactName()
const ConstraintBase & compute(const double t, ConstRefVector q, ConstRefVector v, Data &data)
RobotWrapper & m_robot
Reference on the robot model.
void setContactList(const std::vector< std::shared_ptr< ContactLevel > > *contacts)
const std::vector< std::shared_ptr< ContactLevel > > * m_contacts
SE3 framePosition(const Data &data, const Model::FrameIndex index) const
const Vector3 & getContactNormal() const
const ConstraintBase & getConstraint() const
math::ConstRefVector ConstRefVector
void setContactNormal(const Vector3 &n)
const Vector3 & getReference() const
Eigen::Matrix< Scalar, 3, Eigen::Dynamic > Matrix3x
Wrapper for a robot based on pinocchio.
ConstraintEquality m_constraint
virtual const Matrix & matrix() const
int dim() const
Return the dimension of the task. should be overloaded in the child class.
#define PINOCCHIO_CHECK_INPUT_ARGUMENT(...)