#include <moveit_studio_behavior_interface/behavior_context.hpp>
#include <moveit_studio_behavior_interface/shared_resources_node.hpp>
#include <fp/all.hpp>
#include <moveit_msgs/msg/collision_object.hpp>
#include <moveit_studio_vision_msgs/msg/graspable_object.hpp>
#include <std_srvs/srv/empty.hpp>
|
fp::Result< std::vector< ObjectWithDistance > > | moveit_studio::behaviors::calculateClosestObjectToPose (const tf2_ros::Buffer &buffer, const std::vector< moveit_studio_vision_msgs::msg::GraspableObject > &objects, const geometry_msgs::msg::PoseStamped &pose) |
| Get the closest object to the provided pose. More...
|
|