This Behavior checks a PlanningScene to determine if any object is attached to the robot. Returns SUCCESS if there is an attached CollisionObject, FAILURE otherwise.
More...
#include <is_any_object_attached.hpp>
This Behavior checks a PlanningScene to determine if any object is attached to the robot. Returns SUCCESS if there is an attached CollisionObject, FAILURE otherwise.
Data Port Name | Port Type | Object Type |
planning_scene | input | moveit_msgs::msg::PlanningScene |
◆ IsAnyObjectAttached()
moveit_studio::behaviors::IsAnyObjectAttached::IsAnyObjectAttached |
( |
const std::string & |
name, |
|
|
const BT::NodeConfiguration & |
config |
|
) |
| |
◆ metadata()
BT::KeyValueVector moveit_studio::behaviors::IsAnyObjectAttached::metadata |
( |
| ) |
|
|
static |
◆ providedPorts()
BT::PortsList moveit_studio::behaviors::IsAnyObjectAttached::providedPorts |
( |
| ) |
|
|
static |
◆ tick()
BT::NodeStatus moveit_studio::behaviors::IsAnyObjectAttached::tick |
( |
| ) |
|
|
override |
The documentation for this class was generated from the following files: