6 #include <VirtualRobot/IK/DifferentialIK.h>
7 #include <VirtualRobot/MathTools.h>
8 #include <VirtualRobot/Nodes/RobotNode.h>
9 #include <VirtualRobot/Robot.h>
10 #include <VirtualRobot/RobotNodeSet.h>
13 #include <dmp/representation/dmp/umitsmp.h>
29 NJointControllerRegistration<NJointBimanualForceMPController>
34 const armarx::NJointControllerConfigPtr& config,
38 cfg = NJointBimanualForceMPControllerConfigPtr::dynamicCast(config);
40 VirtualRobot::RobotNodeSetPtr lrns =
rtGetRobot()->getRobotNodeSet(
"LeftArm");
41 for (
size_t i = 0; i < lrns->getSize(); ++i)
43 std::string jointName = lrns->getNode(i)->getName();
46 leftTargets.push_back(ct->
asA<ControlTarget1DoFActuatorVelocity>());
47 const SensorValue1DoFActuatorVelocity* velocitySensor =
48 sv->
asA<SensorValue1DoFActuatorVelocity>();
49 const SensorValue1DoFActuatorPosition* positionSensor =
50 sv->
asA<SensorValue1DoFActuatorPosition>();
54 ARMARX_WARNING <<
"No velocity sensor available for " << jointName;
58 ARMARX_WARNING <<
"No position sensor available for " << jointName;
61 leftVelocitySensors.push_back(velocitySensor);
62 leftPositionSensors.push_back(positionSensor);
65 VirtualRobot::RobotNodeSetPtr rrns =
rtGetRobot()->getRobotNodeSet(
"RightArm");
66 for (
size_t i = 0; i < rrns->getSize(); ++i)
68 std::string jointName = rrns->getNode(i)->getName();
71 rightTargets.push_back(ct->
asA<ControlTarget1DoFActuatorVelocity>());
72 const SensorValue1DoFActuatorVelocity* velocitySensor =
73 sv->
asA<SensorValue1DoFActuatorVelocity>();
74 const SensorValue1DoFActuatorPosition* positionSensor =
75 sv->
asA<SensorValue1DoFActuatorPosition>();
79 ARMARX_WARNING <<
"No velocity sensor available for " << jointName;
83 ARMARX_WARNING <<
"No position sensor available for " << jointName;
86 rightVelocitySensors.push_back(velocitySensor);
87 rightPositionSensors.push_back(positionSensor);
89 const SensorValueBase* svlf = robUnit->getSensorDevice(
"FT L")->getSensorValue();
91 const SensorValueBase* svrf = robUnit->getSensorDevice(
"FT R")->getSensorValue();
94 leftIK.reset(
new VirtualRobot::DifferentialIK(
95 lrns, lrns->getRobot()->getRootNode(), VirtualRobot::JacobiProvider::eSVDDamped));
96 rightIK.reset(
new VirtualRobot::DifferentialIK(
97 rrns, rrns->getRobot()->getRootNode(), VirtualRobot::JacobiProvider::eSVDDamped));
99 leftTCP = lrns->getTCP();
100 rightTCP = rrns->getTCP();
103 rightLearned =
false;
114 taskSpaceDMPConfig.
DMPMode = cfg->dmpMode;
115 taskSpaceDMPConfig.
DMPStyle = cfg->dmpStyle;
126 leftDMPController.reset(
128 rightDMPController.reset(
133 NJointBimanualForceMPControllerSensorData initSensorData;
134 initSensorData.leftPoseInRootFrame = leftTCP->getPoseInRootFrame();
135 initSensorData.leftTwistInRootFrame.setZero();
136 initSensorData.rightPoseInRootFrame = rightTCP->getPoseInRootFrame();
137 initSensorData.rightTwistInRootFrame.setZero();
138 initSensorData.leftForceInRootFrame.setZero();
139 initSensorData.rightForceInRootFrame.setZero();
148 Kp_LinearVel = cfg->Kp_LinearVel;
149 Kp_AngularVel = cfg->Kp_AngularVel;
150 Kd_LinearVel = cfg->Kd_LinearVel;
151 Kd_AngularVel = cfg->Kd_AngularVel;
157 leftFilteredValue.setZero();
158 rightFilteredValue.setZero();
160 for (
size_t i = 0; i < 3; ++i)
162 leftForceOffset(i) = cfg->leftForceOffset.at(i);
164 for (
size_t i = 0; i < 3; ++i)
166 rightForceOffset(i) = cfg->rightForceOffset.at(i);
170 targetSupportForce = cfg->targetSupportForce;
172 NJointBimanualForceMPControllerInterfaceData initInterfaceData;
173 initInterfaceData.leftTcpPoseInRootFrame = leftTCP->getPoseInRootFrame();
174 initInterfaceData.rightTcpPoseInRootFrame = rightTCP->getPoseInRootFrame();
181 return "NJointBimanualForceMPController";
187 if (!controllerSensorData.
updateReadBuffer() || !leftDMPController || !rightDMPController)
196 Eigen::Vector3f leftForce = controllerSensorData.
getReadBuffer().leftForceInRootFrame;
197 Eigen::Vector3f rightForce = controllerSensorData.
getReadBuffer().rightForceInRootFrame;
199 float forceOnHands = (leftForce + rightForce)(2);
202 cfg->forceP * (targetSupportForce + forceOnHands) + I_decay * cfg->forceI * forceIterm;
204 forceIterm += targetSupportForce - forceOnHands;
206 canVal = canVal + forceSign * xvel * deltaT;
210 if (canVal > cfg->timeDuration)
212 canVal = cfg->timeDuration;
216 leftDMPController->canVal = canVal;
217 rightDMPController->canVal = canVal;
219 leftDMPController->flow(deltaT, leftPose, leftTwist);
220 rightDMPController->flow(deltaT, rightPose, rightTwist);
228 std::vector<double> leftTargetState = leftDMPController->getTargetPose();
229 debugOutputData.
getWriteBuffer().dmpTargets[
"leftTarget_x"] = leftTargetState[0];
230 debugOutputData.
getWriteBuffer().dmpTargets[
"leftTarget_y"] = leftTargetState[1];
231 debugOutputData.
getWriteBuffer().dmpTargets[
"leftTarget_z"] = leftTargetState[2];
232 debugOutputData.
getWriteBuffer().dmpTargets[
"leftTarget_qw"] = leftTargetState[3];
233 debugOutputData.
getWriteBuffer().dmpTargets[
"leftTarget_qx"] = leftTargetState[4];
234 debugOutputData.
getWriteBuffer().dmpTargets[
"leftTarget_qy"] = leftTargetState[5];
235 debugOutputData.
getWriteBuffer().dmpTargets[
"leftTarget_qz"] = leftTargetState[6];
236 std::vector<double> rightTargetState = rightDMPController->getTargetPose();
237 debugOutputData.
getWriteBuffer().dmpTargets[
"rightTarget_x"] = rightTargetState[0];
238 debugOutputData.
getWriteBuffer().dmpTargets[
"rightTarget_y"] = rightTargetState[1];
239 debugOutputData.
getWriteBuffer().dmpTargets[
"rightTarget_z"] = rightTargetState[2];
240 debugOutputData.
getWriteBuffer().dmpTargets[
"rightTarget_qw"] = rightTargetState[3];
241 debugOutputData.
getWriteBuffer().dmpTargets[
"rightTarget_qx"] = rightTargetState[4];
242 debugOutputData.
getWriteBuffer().dmpTargets[
"rightTarget_qy"] = rightTargetState[5];
243 debugOutputData.
getWriteBuffer().dmpTargets[
"rightTarget_qz"] = rightTargetState[6];
247 debugOutputData.
getWriteBuffer().currentPose[
"leftPose_x"] = leftPose(0, 3);
248 debugOutputData.
getWriteBuffer().currentPose[
"leftPose_y"] = leftPose(1, 3);
249 debugOutputData.
getWriteBuffer().currentPose[
"leftPose_z"] = leftPose(2, 3);
251 VirtualRobot::MathTools::eigen4f2quat(leftPose);
252 debugOutputData.
getWriteBuffer().currentPose[
"leftPose_qw"] = leftQuat.w;
253 debugOutputData.
getWriteBuffer().currentPose[
"leftPose_qx"] = leftQuat.x;
254 debugOutputData.
getWriteBuffer().currentPose[
"leftPose_qy"] = leftQuat.y;
255 debugOutputData.
getWriteBuffer().currentPose[
"leftPose_qz"] = leftQuat.z;
258 debugOutputData.
getWriteBuffer().currentPose[
"rightPose_x"] = rightPose(0, 3);
259 debugOutputData.
getWriteBuffer().currentPose[
"rightPose_y"] = rightPose(1, 3);
260 debugOutputData.
getWriteBuffer().currentPose[
"rightPose_z"] = rightPose(2, 3);
262 VirtualRobot::MathTools::eigen4f2quat(rightPose);
263 debugOutputData.
getWriteBuffer().currentPose[
"rightPose_qw"] = rightQuat.w;
264 debugOutputData.
getWriteBuffer().currentPose[
"rightPose_qx"] = rightQuat.x;
265 debugOutputData.
getWriteBuffer().currentPose[
"rightPose_qy"] = rightQuat.y;
266 debugOutputData.
getWriteBuffer().currentPose[
"rightPose_qz"] = rightQuat.z;
285 Eigen::MatrixXf leftJacobi =
286 leftIK->getJacobianMatrix(leftTCP, VirtualRobot::IKSolver::CartesianSelection::All);
287 Eigen::MatrixXf rightJacobi =
288 leftIK->getJacobianMatrix(leftTCP, VirtualRobot::IKSolver::CartesianSelection::All);
290 Eigen::VectorXf qvel;
291 qvel.resize(leftVelocitySensors.size());
292 for (
size_t i = 0; i < leftVelocitySensors.size(); ++i)
294 qvel(i) = leftVelocitySensors[i]->velocity;
297 for (
size_t i = 0; i < rightVelocitySensors.size(); ++i)
299 qvel(i) = rightVelocitySensors[i]->velocity;
303 leftFilteredValue = (1 - cfg->filterCoeff) * (leftForceTorque->
force - leftForceOffset) +
304 cfg->filterCoeff * leftFilteredValue;
305 rightFilteredValue = (1 - cfg->filterCoeff) * (rightForceTorque->
force - rightForceOffset) +
306 cfg->filterCoeff * rightFilteredValue;
309 rtGetRobot()->getRobotNode(
"ArmL8_Wri2")->getPoseInRootFrame();
311 rtGetRobot()->getRobotNode(
"ArmR8_Wri2")->getPoseInRootFrame();
313 Eigen::Vector3f leftForceInRootFrame = leftPose.block<3, 3>(0, 0).
transpose() *
314 leftSensorFrame.block<3, 3>(0, 0) *
316 Eigen::Vector3f rightForceInRootFrame = rightPose.block<3, 3>(0, 0).
transpose() *
317 rightSensorFrame.block<3, 3>(0, 0) *
320 controllerSensorData.
getWriteBuffer().leftPoseInRootFrame = leftPose;
321 controllerSensorData.
getWriteBuffer().rightPoseInRootFrame = rightPose;
322 controllerSensorData.
getWriteBuffer().leftTwistInRootFrame = leftTwist;
323 controllerSensorData.
getWriteBuffer().rightTwistInRootFrame = rightTwist;
324 controllerSensorData.
getWriteBuffer().leftForceInRootFrame = leftForceInRootFrame;
325 controllerSensorData.
getWriteBuffer().rightForceInRootFrame = rightForceInRootFrame;
326 controllerSensorData.
getWriteBuffer().deltaT = timeSinceLastIteration.toSecondsDouble();
330 interfaceData.
getWriteBuffer().rightTcpPoseInRootFrame = rightPose;
340 targetPose.block<3, 3>(0, 0) * currentPose.block<3, 3>(0, 0).inverse();
341 Eigen::Vector3f errorRPY = VirtualRobot::MathTools::eigen3f2rpy(diffMat);
344 rtTargetVel.block<3, 1>(0, 0) =
345 Kp_LinearVel * (targetPose.block<3, 1>(0, 3) - currentPose.block<3, 1>(0, 3)) +
346 Kd_LinearVel * (-leftTwist.block<3, 1>(0, 0));
347 rtTargetVel.block<3, 1>(3, 0) =
348 Kp_AngularVel * errorRPY + Kd_AngularVel * (-leftTwist.block<3, 1>(3, 0));
350 float normLinearVelocity = rtTargetVel.block<3, 1>(0, 0).
norm();
351 if (normLinearVelocity > cfg->maxLinearVel)
353 rtTargetVel.block<3, 1>(0, 0) =
354 cfg->maxLinearVel * rtTargetVel.block<3, 1>(0, 0) / normLinearVelocity;
357 float normAngularVelocity = rtTargetVel.block<3, 1>(3, 0).
norm();
358 if (normAngularVelocity > cfg->maxAngularVel)
360 rtTargetVel.block<3, 1>(3, 0) =
361 cfg->maxAngularVel * rtTargetVel.block<3, 1>(3, 0) / normAngularVelocity;
364 for (
size_t i = 0; i < 6; i++)
366 leftVel(i) = rtTargetVel(i);
374 currentPose = rightPose;
379 targetPose.block<3, 3>(0, 0) * currentPose.block<3, 3>(0, 0).inverse();
380 Eigen::Vector3f errorRPY = VirtualRobot::MathTools::eigen3f2rpy(diffMat);
383 rtTargetVel.block<3, 1>(0, 0) =
384 Kp_LinearVel * (targetPose.block<3, 1>(0, 3) - currentPose.block<3, 1>(0, 3)) +
385 Kd_LinearVel * (-rightTwist.block<3, 1>(0, 0));
386 rtTargetVel.block<3, 1>(3, 0) =
387 Kp_AngularVel * errorRPY + Kd_AngularVel * (-rightTwist.block<3, 1>(3, 0));
389 float normLinearVelocity = rtTargetVel.block<3, 1>(0, 0).
norm();
390 if (normLinearVelocity > cfg->maxLinearVel)
392 rtTargetVel.block<3, 1>(0, 0) =
393 cfg->maxLinearVel * rtTargetVel.block<3, 1>(0, 0) / normLinearVelocity;
396 float normAngularVelocity = rtTargetVel.block<3, 1>(3, 0).
norm();
397 if (normAngularVelocity > cfg->maxAngularVel)
399 rtTargetVel.block<3, 1>(3, 0) =
400 cfg->maxAngularVel * rtTargetVel.block<3, 1>(3, 0) / normAngularVelocity;
403 for (
size_t i = 0; i < 6; i++)
405 rightVel(i) = rtTargetVel(i);
410 Eigen::VectorXf leftJTV =
411 leftTCPController->calculate(leftVel,
412 cfg->KpJointLimitAvoidanceScale,
413 VirtualRobot::IKSolver::CartesianSelection::All);
414 for (
size_t i = 0; i < leftTargets.size(); ++i)
416 leftTargets.at(i)->velocity = leftJTV(i);
417 if (!leftTargets.at(i)->isValid())
421 <<
"Velocity controller target is invalid - setting to zero! set value: "
422 << leftTargets.at(i)->velocity;
423 leftTargets.at(i)->velocity = 0.0f;
427 Eigen::VectorXf rightJTV =
428 rightTCPController->calculate(rightVel,
429 cfg->KpJointLimitAvoidanceScale,
430 VirtualRobot::IKSolver::CartesianSelection::All);
431 for (
size_t i = 0; i < rightTargets.size(); ++i)
433 rightTargets.at(i)->velocity = rightJTV(i);
434 if (!rightTargets.at(i)->isValid())
438 <<
"Velocity controller target is invalid - setting to zero! set value: "
439 << rightTargets.at(i)->velocity;
440 rightTargets.at(i)->velocity = 0.0f;
447 const Ice::StringSeq& fileNames,
451 if (whichDMP ==
"Left")
453 leftDMPController->learnDMPFromFiles(fileNames);
457 if (whichDMP ==
"Right")
459 rightDMPController->learnDMPFromFiles(fileNames);
467 const Ice::DoubleSeq& rightGoals,
490 forceSign = leftGoals.at(2) - leftPose(2, 3) > 0 ? -1 : 1;
495 leftDMPController->prepareExecution(leftDMPController->eigen4f2vec(leftPose), leftGoals);
496 rightDMPController->prepareExecution(rightDMPController->eigen4f2vec(rightPose),
499 canVal = cfg->timeDuration;
503 controllerTask->start();
509 const Ice::DoubleSeq& viaPoint,
512 if (whichDMP ==
"Left")
514 leftDMPController->setViaPose(u, viaPoint);
516 if (whichDMP ==
"Right")
518 rightDMPController->setViaPose(u, viaPoint);
527 std::string debugName = cfg->debugName;
528 std::string datafieldName = debugName;
532 for (
auto& pair : dmpTargets)
534 datafieldName = pair.first +
"_" + debugName;
535 datafields[datafieldName] =
new Variant(pair.second);
539 for (
auto& pair : currentPose)
541 datafieldName = pair.first +
"_" + debugName;
542 datafields[datafieldName] =
new Variant(pair.second);
545 datafieldName =
"canVal_" + debugName;
548 datafieldName =
"forceOnHands_" + debugName;
549 datafields[datafieldName] =
551 datafieldName =
"DMPController_" + debugName;
553 debugObs->setDebugChannel(datafieldName, datafields);
568 controllerTask->stop();