Skip to content

Commit

Permalink
Linter
Browse files Browse the repository at this point in the history
Signed-off-by: Gonzalo de Pedro <[email protected]>
Signed-off-by: Jorge Perez <[email protected]>
  • Loading branch information
Gonzalo de Pedro authored and Blast545 committed Feb 12, 2021
1 parent 1c533e9 commit 16bc0bc
Show file tree
Hide file tree
Showing 2 changed files with 4 additions and 4 deletions.
4 changes: 2 additions & 2 deletions bullet/src/JointFeatures.cc
Original file line number Diff line number Diff line change
Expand Up @@ -17,6 +17,7 @@

#include "JointFeatures.hh"

#include <algorithm>
#include <sdf/Joint.hh>

namespace ignition {
Expand Down Expand Up @@ -337,8 +338,7 @@ void JointFeatures::SetJointVelocityCommand(
convertVec(ignition::math::eigen3::convert(jointInfo->axis)));
btVector3 angular_vel = motion * _value;
link->setAngularVelocity(angular_vel);
}
else {
} else {
// igndbg << "Sending command to not revolute joint\n";
}
}
Expand Down
4 changes: 2 additions & 2 deletions bullet/src/SDFFeatures.cc
Original file line number Diff line number Diff line change
Expand Up @@ -121,7 +121,7 @@ Identity SDFFeatures::ConstructSdfLink(
const int modelCollisionGroup = 1 << this->collisionGroups.at(_modelID);
const int collisionMask = 0xFFFFFFFF & ~modelCollisionGroup;
world->addRigidBody(body, modelCollisionGroup, collisionMask);
//world->addRigidBody(body);
// world->addRigidBody(body);

// Generate an identity for it
const auto linkIdentity = this->AddLink({name, body, _modelID, pose, mass,
Expand Down Expand Up @@ -264,7 +264,7 @@ Identity SDFFeatures::ConstructSdfJoint(
// Get axis unit vector (expressed in world frame).
// IF fixed joint, use UnitZ, if revolute use the Axis given by the joint
// Eigen::Vector3d axis;
//ignition::math::Vector3d axis = ignition::math::Vector3d::UnitZ;
// ignition::math::Vector3d axis = ignition::math::Vector3d::UnitZ;
ignition::math::Vector3d axis;
if(type == ::sdf::JointType::FIXED )
{
Expand Down

0 comments on commit 16bc0bc

Please sign in to comment.