18 #ifndef __invdyn_contact_point_hpp__ 19 #define __invdyn_contact_point_hpp__ 30 EIGEN_MAKE_ALIGNED_OPERATOR_NEW
45 const double frictionCoefficient,
const double minNormalForce,
46 const double maxNormalForce);
51 virtual unsigned int n_motion()
const;
54 virtual unsigned int n_force()
const;
68 const double t, ConstRefVector q, ConstRefVector v,
const Data& data);
85 void Kp(ConstRefVector Kp);
86 void Kd(ConstRefVector Kp);
132 #endif // ifndef __invdyn_contact_6d_hpp__
const Eigen::Ref< const Matrix > ConstRefMatrix
Eigen::Matrix< Scalar, Eigen::Dynamic, 1 > Vector
Eigen::Matrix< Scalar, 3, 1 > Vector3
const Eigen::Ref< const Vector > ConstRefVector
Eigen::Matrix< Scalar, 3, Eigen::Dynamic > Matrix3x
Wrapper for a robot based on pinocchio.
Eigen::TensorRef< Tensor > ref(Eigen::TensorRef< Tensor > tensor)
Eigen::Matrix< Scalar, 6, 1 > Vector6