Skip to content

Commit

Permalink
4 ➡️ 5 (main) (#292)
Browse files Browse the repository at this point in the history
Signed-off-by: Louise Poubel <[email protected]>
  • Loading branch information
chapulina authored Sep 13, 2021
2 parents 32de314 + b3fe9d8 commit 45b52a4
Show file tree
Hide file tree
Showing 21 changed files with 1,220 additions and 83 deletions.
3 changes: 1 addition & 2 deletions .github/CODEOWNERS
Validating CODEOWNERS rules …
Original file line number Diff line number Diff line change
@@ -1,5 +1,4 @@
# More info:
# https://help.github.com/en/github/creating-cloning-and-archiving-repositories/about-code-owners

* @mxgrey
include/* @scpeters
* @azeey @mxgrey @scpeters
1 change: 0 additions & 1 deletion CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -15,7 +15,6 @@ find_package(ignition-cmake2 2.8.0 REQUIRED)
#============================================================================
ign_configure_project(VERSION_SUFFIX)


#============================================================================
# Set project-specific options
#============================================================================
Expand Down
5 changes: 4 additions & 1 deletion Changelog.md
Original file line number Diff line number Diff line change
Expand Up @@ -127,7 +127,10 @@

### Ignition Physics 3.x.x (20XX-XX-XX)

### Ignition Physics 3.3.0 (2021-06-18)
### Ignition Physics 3.3.0 (2021-07-12)

1. Use slip compliance API's available in upstream dartsim release
* [Pull request #265](https:/ignitionrobotics/ign-physics/pull/265)

1. Fix DART deprecation warning
* [Pull request #263](https:/ignitionrobotics/ign-physics/pull/263)
Expand Down
60 changes: 0 additions & 60 deletions bitbucket-pipelines.yml

This file was deleted.

8 changes: 8 additions & 0 deletions dartsim/src/Base.hh
Original file line number Diff line number Diff line change
Expand Up @@ -72,6 +72,7 @@ struct ModelInfo
struct JointInfo
{
dart::dynamics::JointPtr joint;
dart::dynamics::SimpleFramePtr frame;
};

struct ShapeInfo
Expand Down Expand Up @@ -352,6 +353,13 @@ class Base : public Implements3d<FeatureList<Feature>>
this->joints.idToObject[id] = std::make_shared<JointInfo>();
this->joints.idToObject[id]->joint = _joint;
this->joints.objectToID[_joint] = id;
dart::dynamics::SimpleFramePtr jointFrame =
dart::dynamics::SimpleFrame::createShared(
_joint->getChildBodyNode(), _joint->getName() + "_frame",
_joint->getTransformFromChildBodyNode());

this->joints.idToObject[id]->frame = jointFrame;
this->frames[id] = this->joints.idToObject[id]->frame.get();

return id;
}
Expand Down
158 changes: 158 additions & 0 deletions dartsim/src/JointFeatures.cc
Original file line number Diff line number Diff line change
Expand Up @@ -163,9 +163,167 @@ void JointFeatures::SetJointVelocityCommand(
{
joint->setActuatorType(dart::dynamics::Joint::SERVO);
}
// warn about bug https:/dartsim/dart/issues/1583
if ((joint->getPositionLowerLimit(_dof) > -1e16 ||
joint->getPositionUpperLimit(_dof) < 1e16 ) &&
(!std::isfinite(joint->getForceUpperLimit(_dof)) ||
!std::isfinite(joint->getForceLowerLimit(_dof))))
{
static bool informed = false;
if (!informed)
{
ignerr << "Velocity control does not respect positional limits of "
<< "joints if these joints do not have an effort limit. Please, "
<< "set min and max effort for joint [" << joint->getName()
<< "] to values about -1e6 and 1e6 (or higher if working with "
<< "heavy links)." << std::endl;
informed = true;
}
}

joint->setCommand(_dof, _value);
}

/////////////////////////////////////////////////
void JointFeatures::SetJointMinPosition(
const Identity &_id, const std::size_t _dof, const double _value)
{
auto joint = this->ReferenceInterface<JointInfo>(_id)->joint;

// Take extra care that the value is valid. A nan can cause the DART
// constraint solver to fail, which will in turn either cause a crash or
// collisions to fail
if (std::isnan(_value))
{
ignerr << "Invalid minimum joint position value [" << _value
<< "] commanded on joint [" << joint->getName() << " DOF " << _dof
<< "]. The command will be ignored\n";
return;
}
#if DART_VERSION_AT_LEAST(6, 10, 0)
joint->setLimitEnforcement(true);
#else
joint->setPositionLimitEnforced(true);
#endif
// We do not check min/max mismatch, we leave that to DART.
joint->setPositionLowerLimit(_dof, _value);
}

/////////////////////////////////////////////////
void JointFeatures::SetJointMaxPosition(
const Identity &_id, const std::size_t _dof, const double _value)
{
auto joint = this->ReferenceInterface<JointInfo>(_id)->joint;

// Take extra care that the value is valid. A nan can cause the DART
// constraint solver to fail, which will in turn either cause a crash or
// collisions to fail
if (std::isnan(_value))
{
ignerr << "Invalid maximum joint position value [" << _value
<< "] commanded on joint [" << joint->getName() << " DOF " << _dof
<< "]. The command will be ignored\n";
return;
}
#if DART_VERSION_AT_LEAST(6, 10, 0)
joint->setLimitEnforcement(true);
#else
joint->setPositionLimitEnforced(true);
#endif
// We do not check min/max mismatch, we leave that to DART.
joint->setPositionUpperLimit(_dof, _value);
}

/////////////////////////////////////////////////
void JointFeatures::SetJointMinVelocity(
const Identity &_id, const std::size_t _dof, const double _value)
{
auto joint = this->ReferenceInterface<JointInfo>(_id)->joint;

// Take extra care that the value is valid. A nan can cause the DART
// constraint solver to fail, which will in turn either cause a crash or
// collisions to fail
if (std::isnan(_value))
{
ignerr << "Invalid minimum joint velocity value [" << _value
<< "] commanded on joint [" << joint->getName() << " DOF " << _dof
<< "]. The command will be ignored\n";
return;
}
#if DART_VERSION_AT_LEAST(6, 10, 0)
joint->setLimitEnforcement(true);
#else
joint->setPositionLimitEnforced(true);
#endif
// We do not check min/max mismatch, we leave that to DART.
joint->setVelocityLowerLimit(_dof, _value);
}

/////////////////////////////////////////////////
void JointFeatures::SetJointMaxVelocity(
const Identity &_id, const std::size_t _dof, const double _value)
{
auto joint = this->ReferenceInterface<JointInfo>(_id)->joint;

// Take extra care that the value is valid. A nan can cause the DART
// constraint solver to fail, which will in turn either cause a crash or
// collisions to fail
if (std::isnan(_value))
{
ignerr << "Invalid maximum joint velocity value [" << _value
<< "] commanded on joint [" << joint->getName() << " DOF " << _dof
<< "]. The command will be ignored\n";
return;
}
#if DART_VERSION_AT_LEAST(6, 10, 0)
joint->setLimitEnforcement(true);
#else
joint->setPositionLimitEnforced(true);
#endif
// We do not check min/max mismatch, we leave that to DART.
joint->setVelocityUpperLimit(_dof, _value);
}

/////////////////////////////////////////////////
void JointFeatures::SetJointMinEffort(
const Identity &_id, const std::size_t _dof, const double _value)
{
auto joint = this->ReferenceInterface<JointInfo>(_id)->joint;

// Take extra care that the value is valid. A nan can cause the DART
// constraint solver to fail, which will in turn either cause a crash or
// collisions to fail
if (std::isnan(_value))
{
ignerr << "Invalid minimum joint effort value [" << _value
<< "] commanded on joint [" << joint->getName() << " DOF " << _dof
<< "]. The command will be ignored\n";
return;
}
// We do not check min/max mismatch, we leave that to DART.
joint->setForceLowerLimit(_dof, _value);
}

/////////////////////////////////////////////////
void JointFeatures::SetJointMaxEffort(
const Identity &_id, const std::size_t _dof, const double _value)
{
auto joint = this->ReferenceInterface<JointInfo>(_id)->joint;

// Take extra care that the value is valid. A nan can cause the DART
// constraint solver to fail, which will in turn either cause a crash or
// collisions to fail
if (std::isnan(_value))
{
ignerr << "Invalid maximum joint effort value [" << _value
<< "] commanded on joint [" << joint->getName() << " DOF " << _dof
<< "]. The command will be ignored\n";
return;
}
// We do not check min/max mismatch, we leave that to DART.
joint->setForceUpperLimit(_dof, _value);
}

/////////////////////////////////////////////////
std::size_t JointFeatures::GetJointDegreesOfFreedom(const Identity &_id) const
{
Expand Down
29 changes: 28 additions & 1 deletion dartsim/src/JointFeatures.hh
Original file line number Diff line number Diff line change
Expand Up @@ -52,7 +52,10 @@ struct JointFeatureList : FeatureList<
GetPrismaticJointProperties,
AttachPrismaticJointFeature,

SetJointVelocityCommandFeature
SetJointVelocityCommandFeature,
SetJointPositionLimitsFeature,
SetJointVelocityLimitsFeature,
SetJointEffortLimitsFeature
> { };

class JointFeatures :
Expand Down Expand Up @@ -171,6 +174,30 @@ class JointFeatures :
public: void SetJointVelocityCommand(
const Identity &_id, const std::size_t _dof,
const double _value) override;

public: void SetJointMinPosition(
const Identity &_id, const std::size_t _dof,
const double _value) override;

public: void SetJointMaxPosition(
const Identity &_id, const std::size_t _dof,
const double _value) override;

public: void SetJointMinVelocity(
const Identity &_id, const std::size_t _dof,
const double _value) override;

public: void SetJointMaxVelocity(
const Identity &_id, const std::size_t _dof,
const double _value) override;

public: void SetJointMinEffort(
const Identity &_id, const std::size_t _dof,
const double _value) override;

public: void SetJointMaxEffort(
const Identity &_id, const std::size_t _dof,
const double _value) override;
};

}
Expand Down
Loading

0 comments on commit 45b52a4

Please sign in to comment.