MoveIt Studio Behavior Interface
2.11.0
Library for developing custom behaviors for use in MoveIt Studio
|
#include <fp/result.hpp>
#include <geometry_msgs/msg/transform_stamped.hpp>
#include <std_msgs/msg/header.hpp>
#include <tf2_ros/buffer.h>
Namespaces | |
moveit_studio | |
moveit_studio::helper_functions | |
Functions | |
fp::Result< geometry_msgs::msg::TransformStamped > | moveit_studio::helper_functions::getTransform (const tf2_ros::Buffer &buffer, const std::string &parent_frame_id, const std_msgs::msg::Header &child_frame_header, const std::chrono::duration< double > &timeout) |
Wraps a TF lookup within an fp::Result. More... | |