$search
Public Member Functions | |
| def | __init__ |
| def | can_transform |
| def | can_transform_full |
| def | lookup_transform |
| def | lookup_transform_full |
| def | transform |
| def | transform_full |
Public Attributes | |
| registration | |
Definition at line 37 of file buffer_interface.py.
| def tf2_ros::buffer_interface::BufferInterface::__init__ | ( | self | ) |
Definition at line 38 of file buffer_interface.py.
| def tf2_ros::buffer_interface::BufferInterface::can_transform | ( | self, | ||
| target_frame, | ||||
| source_frame, | ||||
| time, | ||||
timeout = rospy.Duration(0.0) | ||||
| ) |
Definition at line 71 of file buffer_interface.py.
| def tf2_ros::buffer_interface::BufferInterface::can_transform_full | ( | self, | ||
| target_frame, | ||||
| target_time, | ||||
| source_frame, | ||||
| source_time, | ||||
| fixed_frame, | ||||
timeout = rospy.Duration(0.0) | ||||
| ) |
Definition at line 75 of file buffer_interface.py.
| def tf2_ros::buffer_interface::BufferInterface::lookup_transform | ( | self, | ||
| target_frame, | ||||
| source_frame, | ||||
| time, | ||||
timeout = rospy.Duration(0.0) | ||||
| ) |
Definition at line 63 of file buffer_interface.py.
| def tf2_ros::buffer_interface::BufferInterface::lookup_transform_full | ( | self, | ||
| target_frame, | ||||
| target_time, | ||||
| source_frame, | ||||
| source_time, | ||||
| fixed_frame, | ||||
timeout = rospy.Duration(0.0) | ||||
| ) |
Definition at line 67 of file buffer_interface.py.
| def tf2_ros::buffer_interface::BufferInterface::transform | ( | self, | ||
| object_stamped, | ||||
| target_frame, | ||||
timeout = rospy.Duration(0.0), |
||||
new_type = None | ||||
| ) |
Definition at line 42 of file buffer_interface.py.
| def tf2_ros::buffer_interface::BufferInterface::transform_full | ( | self, | ||
| object_stamped, | ||||
| target_frame, | ||||
| target_time, | ||||
| fixed_frame, | ||||
timeout = rospy.Duration(0.0), |
||||
new_type = None | ||||
| ) |
Definition at line 52 of file buffer_interface.py.
Definition at line 39 of file buffer_interface.py.