TF buffer whose functions with timeout can be interrupted. More...
#include <memory>#include <mutex>#include <string>#include <geometry_msgs/TransformStamped.h>#include <ros/duration.h>#include <ros/time.h>#include <tf2/buffer_core.h>#include <tf2_ros/buffer.h>#include <cras_cpp_common/time_utils/interruptible_sleep_interface.h>#include <cras_cpp_common/thread_utils/semaphore.hpp>

Go to the source code of this file.
| Classes | |
| class | cras::InterruptibleTFBuffer | 
| Provides overrides of canTransform() that can be interrupted. Normally, canTransform() waits until transform is available, timeout is reached (which may be never in paused simulation), time jumps backwards or ros::ok() returns false. This buffer adds another option of interrupting the call. It also allows "wrapping around" another buffer that does not support this interruptibility and add this ability to it.  More... | |
| Namespaces | |
| cras | |
TF buffer whose functions with timeout can be interrupted.
Definition in file interruptible_buffer.h.