Skip to content

Commit

Permalink
typos, comments, style
Browse files Browse the repository at this point in the history
Signed-off-by: Ian Chen <[email protected]>
  • Loading branch information
iche033 committed Mar 5, 2024
1 parent 44e0958 commit ca1715e
Show file tree
Hide file tree
Showing 3 changed files with 13 additions and 13 deletions.
6 changes: 3 additions & 3 deletions bullet-featherstone/src/Base.hh
Original file line number Diff line number Diff line change
Expand Up @@ -394,8 +394,6 @@ class Base : public Implements3d<FeatureList<Feature>>
if (!model)
return false;

Check warning on line 395 in bullet-featherstone/src/Base.hh

View check run for this annotation

Codecov / codecov/patch

bullet-featherstone/src/Base.hh#L395

Added line #L395 was not covered by tests

bool isNested = this->worlds.find(_parentID) == this->worlds.end();

// Remove nested models
for (auto &nestedModelID : model->nestedModelEntityIds)
{
Expand Down Expand Up @@ -423,7 +421,9 @@ class Base : public Implements3d<FeatureList<Feature>>
}
}

// If nested, we are done here. No need to remove multibody
// If nested, no need to remove multibody
// \todo(iche033) Remove links and joints in nested model
bool isNested = this->worlds.find(_parentID) == this->worlds.end();
if (isNested)
{
return true;
Expand Down
2 changes: 0 additions & 2 deletions bullet-featherstone/src/EntityManagementFeatures.cc
Original file line number Diff line number Diff line change
Expand Up @@ -206,8 +206,6 @@ Identity EntityManagementFeatures::ConstructEmptyWorld(
bool EntityManagementFeatures::RemoveModel(const Identity &_modelID)
{
auto *model = this->ReferenceInterface<ModelInfo>(_modelID);
if (!model)
return false;
return this->RemoveModelImpl(model->world, _modelID);

Check warning on line 209 in bullet-featherstone/src/EntityManagementFeatures.cc

View check run for this annotation

Codecov / codecov/patch

bullet-featherstone/src/EntityManagementFeatures.cc#L209

Added line #L209 was not covered by tests
}

Expand Down
18 changes: 10 additions & 8 deletions bullet-featherstone/src/SDFFeatures.cc
Original file line number Diff line number Diff line change
Expand Up @@ -179,7 +179,7 @@ ::sdf::Errors resolveJointPoseRelToLink(math::Pose3d &_resolvedPose,
return errors;
}

// compute joint pose relative to parent link
// compute joint pose relative to specified link
const auto *link = _model->LinkByName(_link);
if (!link)
{
Expand All @@ -204,6 +204,7 @@ ::sdf::Errors resolveJointPoseRelToLink(math::Pose3d &_resolvedPose,

/////////////////////////////////////////////////
/// \brief Recursively build a tree of parent-child data structures from the
/// input Model SDF.
/// \param[in] _sdfModel input Model SDF.
/// \param[out] _parentOf A map of child link to its parent
/// \param[out] _linkTree A map of parent link to its child links
Expand Down Expand Up @@ -302,7 +303,8 @@ bool buildTrees(const ::sdf::Model *_sdfModel,
/// \brief Find all the root links given a model SDF
/// \param[in] _sdfModel Model SDF
/// \param[in] _parentOf A map of child link to its parent info
/// \param[out] _rootLinks A vector of root links and its immediate parent model
/// \param[out] _rootLinks A vector of root links paired with their
/// immediate parent model
void findRootLinks(const ::sdf::Model *_sdfModel,
const std::unordered_map<const ::sdf::Link*, ParentInfo> &_parentOf,
std::vector<std::pair<const ::sdf::Link*, const ::sdf::Model*>> &_rootLinks)
Expand Down Expand Up @@ -472,12 +474,13 @@ Identity SDFFeatures::ConstructSdfModelImpl(
// multiple sub-trees detected in model
// \todo(iche033) support multiple kinematic trees and
// multiple floating links in a single model
// https://github.com/gazebosim/gz-physics/issues/550
gzerr << "Multiple sub-trees / floating links detected in a model. "
<< "This is not supported in bullet-featherstone implementation yet."
<< std::endl;
}
// Create model for the first structure.
auto structure = structures[0];
auto &structure = structures[0];

const bool isStatic = _sdfModel.Static();
WorldInfo *world = nullptr;
Expand Down Expand Up @@ -688,7 +691,6 @@ Identity SDFFeatures::ConstructSdfModelImpl(
btTransform parentLocalInertialFrame = convertTf(
parentLinkInfo->inertiaToLinkFrame);
btTransform parent2jointBt = convertTf(
// gz::math::eigen3::convert(parent2joint.Inverse())); // X_PJ
poseParentLinkToJoint); // X_PJ

// offsetInABt = parent COM to pivot (X_IpJ)
Expand All @@ -702,7 +704,7 @@ Identity SDFFeatures::ConstructSdfModelImpl(
btTransform offsetInABt, offsetInBBt;
offsetInABt = parentLocalInertialFrame * parent2jointBt;
offsetInBBt =
convertTf(linkToComTf.inverse() * poseJointToChild.inverse());
convertTf(linkToComTf.inverse() * poseJointToChild.inverse());
// R_IcJ * R_IpJ ^ -1 = R_IcIp;
btQuaternion parentRotToThis =
offsetInBBt.getRotation() * offsetInABt.inverse().getRotation();
Expand Down Expand Up @@ -802,7 +804,7 @@ Identity SDFFeatures::ConstructSdfModelImpl(
return this->GenerateInvalidId();

auto modelToNestedModel = Eigen::Isometry3d::Identity();
// if the model of the root link is in a top level model, compute
// if the model of the root link is nested in a top level model, compute
// its pose relative to top level model
if (structure.model != &_sdfModel)
{
Expand Down Expand Up @@ -1267,7 +1269,7 @@ Identity SDFFeatures::ConstructSdfJoint(
// >= 2.89. This is needed for dynamically creating world joints,
// i.e. setting the btMultiBody to be fixed. So output an error letting
// users know the joint will not be created.
// \todo(iche033) An workaround for this is to loop through all the joints
// \todo(iche033) A workaround for this is to loop through all the joints
// in the world first in ConstructSdfWorld, keep track of the models who are
// a child of the world joint, then when creating the btMultiBody
// in ConstructSdfModelImpl, pass fixedBase as true in its constructor.
Expand Down Expand Up @@ -1297,7 +1299,7 @@ Identity SDFFeatures::ConstructSdfJoint(
childLinkName = _sdfJoint.ChildName();
}

// Currently only supports constructing joint with world
// Currently only supports constructing fixed joint with world as parent
if (parentLinkName == "world" && _sdfJoint.Type() == ::sdf::JointType::FIXED)
{
auto worldModelIt = this->models.find(_modelID);
Expand Down

0 comments on commit ca1715e

Please sign in to comment.