MoveIt Studio Behavior
2.9.2
Core Behaviors for the MoveIt Studio Application
|
#include <string>
#include <memory>
#include <behaviortree_cpp/action_node.h>
#include <behaviortree_cpp/bt_factory.h>
#include <moveit_studio_behavior_interface/behavior_context.hpp>
#include <moveit_studio_behavior_interface/shared_resources_node.hpp>
Classes | |
class | moveit_studio::behaviors::WritePoseToYAML |
Write contents of a geometry_msgs::msg::Pose (x,y,z,qx,qy,qz.qw) to YAML file. Note: The behavior saves the pose into the ~/.config/moveit_studio/robot_config/objectives folder. More... | |
Namespaces | |
moveit_studio | |
moveit_studio::behaviors | |