25#include <tf2_geometry_msgs/tf2_geometry_msgs.h> 
   27#include <tf2/transform_datatypes.h> 
   29#include <tf2_ros/buffer.h> 
   30#include <tf2_ros/transform_listener.h> 
   37  CbWaitTransform(std::string targetFrame, std::string referenceFrame, rclcpp::Duration timeout);
 
   41  template <
typename TOrthogonal, 
typename TSourceObject>
 
   44    smacc2::SmaccAsyncClientBehavior::onOrthogonalAllocation<TOrthogonal, TSourceObject>();
 
   58  std::optional<tf2::Stamped<tf2::Transform>> 
result_;