We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 1630447 commit d0d9135Copy full SHA for d0d9135
kf_hungarian_tracker/kf_hungarian_tracker/kf_hungarian_node.py
@@ -10,6 +10,7 @@
10
import colorsys
11
from kf_hungarian_tracker.obstacle_class import ObstacleClass
12
13
+from tf2_ros import TransformException
14
from tf2_ros.buffer import Buffer
15
from tf2_ros.transform_listener import TransformListener
16
from tf2_geometry_msgs import do_transform_point, do_transform_vector3
@@ -119,7 +120,7 @@ def callback(self, msg):
119
120
s.vector = detections[i].size
121
detections[i].size = do_transform_vector3(s, trans).vector
122
- except Exception as ex:
123
+ except TransformException as ex:
124
self.get_logger().error(
125
'fail to get tf from {} to {}: {}'.format(
126
msg.header.frame_id, self.global_frame, ex))
0 commit comments