MoveIt Studio Behavior
2.8.2
Core Behaviors for the MoveIt Studio Application
|
#include <behaviortree_cpp/action_node.h>
#include <behaviortree_cpp/bt_factory.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
#include <geometry_msgs/msg/twist_stamped.hpp>
#include <geometry_msgs/msg/transform_stamped.hpp>
#include <geometry_msgs/msg/wrench_stamped.hpp>
#include <moveit_studio_behavior_interface/behavior_context.hpp>
#include <moveit_studio_behavior_interface/shared_resources_node.hpp>
Classes | |
class | moveit_studio::behaviors::IsForceWithinThreshold |
Checks for wrench messages from a topic and report failure if it exceed a threshold value. More... | |
Namespaces | |
moveit_studio | |
moveit_studio::behaviors | |
moveit_studio::behaviors::wrench_measurement | |
Functions | |
bool | moveit_studio::behaviors::wrench_measurement::forceIsOutsideBounds (const geometry_msgs::msg::Wrench &measured, const double force_threshold) |
Evaluate if any force in measured wrench are outside the specified force threshold. More... | |