MoveIt Studio Behavior  2.8.2
Core Behaviors for the MoveIt Studio Application
get_drawer_axis_from_selection.hpp File Reference
#include <behaviortree_cpp/action_node.h>
#include <behaviortree_cpp/bt_factory.h>
#include <moveit_studio_behavior_interface/behavior_context.hpp>
#include <moveit_studio_behavior/utils/affordance_transforms.hpp>
#include <optional>
Include dependency graph for get_drawer_axis_from_selection.hpp:
This graph shows which files directly or indirectly include this file:

Classes

class  moveit_studio::behaviors::GetDrawerAxisFromSelection
 Given an input PoseStamped representing a grasp pose selected on a drawer handle, output three PoseStampeds that define a screw motion to open the drawer. More...
 

Namespaces

 moveit_studio
 
 moveit_studio::behaviors
 
 moveit_studio::behaviors::affordance_transforms
 

Functions

OrderedAffordancePoses moveit_studio::behaviors::affordance_transforms::getDrawerAffordancePoses (const geometry_msgs::msg::PoseStamped &grasp_pose, const double grasp_rotation=0.0)
 Given a grasp pose on a drawer handle, calculate poses that define a screw axis which opens the drawer along the grasp pose Z- axis. More...