You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
I have a multi camera setup and is attempting to get the extrinsic transformations for each camera. For this I used a class object in python to retrieve the static transform of each camera during initialization as follows:
The code can run in a realtime setting with the camera ros driver running and getting realtime camera feedbacks. However when I attempted to analyse the rosbags using robag play tf2 was unable to lookuptransform for the second camera (I am using two cameras). It is peculiar that the code is able to get camera transform from one camera only using rosbag play, but failed when getting transforms from both cameras.
Following is the error snippet when attempting to get transforms from the two cameras (left and right):
File src/tracker/SynchronisedCamera.py", line 231, in get_transform_with_retry
transform = self.tf_buffer.lookup_transform(self.camera_frame, self.reference_frame, rospy.Time(0),
File "/opt/ros/noetic/lib/python3/dist-packages/tf2_ros/buffer.py", line 90, in lookup_transform
return self.lookup_transform_core(target_frame, source_frame, time)
tf2.LookupException: "camera_right_rgb_optical_frame" passed to lookupTransform argument target_frame does not exist.
The text was updated successfully, but these errors were encountered:
I have a multi camera setup and is attempting to get the extrinsic transformations for each camera. For this I used a class object in python to retrieve the static transform of each camera during initialization as follows:
The code can run in a realtime setting with the camera ros driver running and getting realtime camera feedbacks. However when I attempted to analyse the rosbags using robag play tf2 was unable to lookuptransform for the second camera (I am using two cameras). It is peculiar that the code is able to get camera transform from one camera only using rosbag play, but failed when getting transforms from both cameras.
Following is the error snippet when attempting to get transforms from the two cameras (left and right):
The text was updated successfully, but these errors were encountered: