Skip to content

Commit 2424a19

Browse files
committed
Fix linter errors
1 parent 0b65590 commit 2424a19

File tree

4 files changed

+3
-9
lines changed

4 files changed

+3
-9
lines changed

src/compas_fab/backends/ros/client.py

Lines changed: 0 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -169,7 +169,6 @@ def load_robot(self, load_geometry=False, urdf_param_name='/robot_description',
169169

170170
return Robot(model, semantics=semantics, client=self)
171171

172-
173172
def inverse_kinematics(self, frame, base_link, group,
174173
joint_names, joint_positions, avoid_collisions=True,
175174
constraints=None, attempts=8,

src/compas_fab/backends/ros/messages/geometry_msgs.py

Lines changed: 0 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -97,7 +97,6 @@ def from_msg(cls, msg):
9797
return cls(x, y, z)
9898

9999

100-
101100
class Transform(ROSmsg):
102101
"""http://docs.ros.org/api/geometry_msgs/html/msg/Transform.html
103102
"""

src/compas_fab/robots/inertia.py

Lines changed: 2 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -48,8 +48,8 @@ def __init__(self, inertia_tensor, mass, center_of_mass):
4848
def principal_moments(self):
4949
"""Returns the diagonal elements of the inertia tensor [ixx, iyy, izz]
5050
"""
51-
I = self.inertia_tensor
52-
return [I[0][0], I[1][1], I[2][2]]
51+
inertia_tensor = self.inertia_tensor
52+
return [inertia_tensor[0][0], inertia_tensor[1][1], inertia_tensor[2][2]]
5353

5454
def __repr__(self):
5555
return "Inertia({0}, {1}, {2})".format(self.inertia_tensor, self.mass, self.center_of_mass)
@@ -59,4 +59,3 @@ def calculate_inertia_tensor(cls, mesh):
5959
"""Returns the inertia tensor.
6060
"""
6161
raise NotImplementedError
62-

src/compas_fab/robots/wrench.py

Lines changed: 1 addition & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -3,8 +3,6 @@
33
import math
44

55
import compas
6-
from compas.geometry import Frame
7-
from compas.geometry import Transformation
86
from compas.geometry import Vector
97
from compas.geometry import cross_vectors
108

@@ -284,7 +282,7 @@ def __eq__(self, other, tol=1e-05):
284282
if math.fabs(a - b) > tol:
285283
return False
286284
return True
287-
285+
288286
def __ne__(self, other, tol=1e-05):
289287
return not self.__eq__(other, tol)
290288

@@ -387,4 +385,3 @@ def gravity_compensated(self, ft_sensor_frame, mass, center_of_mass):
387385
torque_gravity = Vector(*cross_vectors((center_of_mass * mass), gravity_vector_FTSCS))
388386

389387
return Wrench(self.force - force_gravity, self.torque - torque_gravity)
390-

0 commit comments

Comments
 (0)