Skip to content

Commit

Permalink
Removed unnecessary comments
Browse files Browse the repository at this point in the history
  • Loading branch information
joel-mb committed Sep 3, 2022
1 parent ec82fdf commit e631607
Show file tree
Hide file tree
Showing 2 changed files with 0 additions and 3 deletions.
2 changes: 0 additions & 2 deletions carla_ros_bridge/src/carla_ros_bridge/actor_factory.py
Original file line number Diff line number Diff line change
Expand Up @@ -144,8 +144,6 @@ def update_actor_states(self, frame_id, timestamp):
for actor_id in self.actors:
try:
actor = self.actors[actor_id]
if isinstance(actor, Sensor):
self.node.loginfo(actor.__class__.__name__)
self.actors[actor_id].update(frame_id, timestamp)
except RuntimeError as e:
self.node.logwarn("Update actor {}({}) failed: {}".format(
Expand Down
1 change: 0 additions & 1 deletion carla_ros_bridge/src/carla_ros_bridge/sensor.py
Original file line number Diff line number Diff line change
Expand Up @@ -116,7 +116,6 @@ def get_ros_transform(self, pose, timestamp):
frame_id = self.parent.get_prefix()
else:
frame_id = "map"
self.node.loginfo("Haciendo relative tf: {}, {}".format(child_frame_id, frame_id))

transform = tf2_ros.TransformStamped()
transform.header.stamp = roscomp.ros_timestamp(sec=timestamp, from_sec=True)
Expand Down

0 comments on commit e631607

Please sign in to comment.