Go to the documentation of this file.
26 using namespace trajectories;
31 const std::string& frameName1,
32 const std::string& frameName2)
34 m_frame_name1(frameName1),
35 m_frame_name2(frameName2),
82 assert(
Kp.size() == 6);
87 assert(
Kd.size() == 6);
123 Motion v_frame1, v_frame2;
124 Motion m_drift1, m_drift2;
134 m_wMl1.rotation(oMi1.rotation());
135 m_wMl2.rotation(oMi2.rotation());
165 for (
int i = 0;
i < 6;
i++) {
void Kp(ConstRefVector Kp)
SE3 framePosition(const Data &data, const Model::FrameIndex index) const
Motion frameVelocity(const Data &data, const Model::FrameIndex index) const
void errorInSE3(const pinocchio::SE3 &M, const pinocchio::SE3 &Mdes, pinocchio::Motion &error)
const Vector & vector() const override
const Vector & Kd() const
const Vector & position_error() const override
Abstract class representing a linear equality/inequality constraint. Equality constraints are represe...
Vector m_v_error_masked_vec
virtual void setMask(math::ConstRefVector mask)
bool existFrame(const std::string &name, const FrameType &type=(FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR)) const
void resize(unsigned int r, unsigned int c) override
const ConstraintBase & getConstraint() const override
virtual void setMask(math::ConstRefVector mask) override
const Vector & Kp() const
Motion frameClassicAcceleration(const Data &data, const Model::FrameIndex index) const
const Model & model() const
Accessor to model.
virtual const Matrix & matrix() const
TaskTwoFramesEquality(const std::string &name, RobotWrapper &robot, const std::string &frameName1, const std::string &frameName2)
Vector m_p_error_masked_vec
ConstraintEquality m_constraint
FrameIndex getFrameId(const std::string &name, const FrameType &type=(FrameType)(JOINT|FIXED_JOINT|BODY|OP_FRAME|SENSOR)) const
void frameJacobianLocal(Data &data, const Model::FrameIndex index, Data::Matrix6x &J) const
const typedef Eigen::Ref< const Vector > ConstRefVector
const Vector & getDesiredAcceleration() const override
Vector getAcceleration(ConstRefVector dv) const override
Wrapper for a robot based on pinocchio.
RobotWrapper & m_robot
Reference on the robot model.
const ConstraintBase & compute(const double t, ConstRefVector q, ConstRefVector v, Data &data) override
const Vector & velocity_error() const override
int dim() const override
Return the dimension of the task. \info should be overloaded in the child class.
math::ConstRefVector ConstRefVector
tsid
Author(s): Andrea Del Prete, Justin Carpentier
autogenerated on Thu Apr 3 2025 02:47:16