![]() |
MoveIt Pro API
Core Behaviors for MoveIt Pro
|
This Behavior computes the Cartesian Pose of a link from a given Joint State. If the Joint State message does not contain all of the joints for calculating the pose, it will use the existing joint states for the missing joint states. More...
#include <compute_link_pose_forward_kinematics.hpp>
Classes | |
struct | InfoAndWarnings |
Public Member Functions | |
ComputeLinkPoseForwardKinematics (const std::string &name, const BT::NodeConfiguration &config, const std::shared_ptr< moveit_studio::behaviors::BehaviorContext > &shared_resources) | |
BT::NodeStatus | tick () override |
tl::expected< geometry_msgs::msg::PoseStamped, std::string > | compute_link_pose_forward_kinematics (const moveit_msgs::msg::PlanningScene &planning_scene, const std::shared_ptr< moveit::core::RobotModel > &robot_model, const sensor_msgs::msg::JointState &joint_state_for_fk, const std::string &link_name, const std::shared_ptr< moveit_studio::behaviors::BehaviorContext > &shared_resources, InfoAndWarnings &info_and_warnings) const |
![]() | |
SharedResourcesNode (const std::string &name, const BT::NodeConfiguration &config, const std::shared_ptr< BehaviorContext > &shared_resources) | |
Constructor for SharedResourcesNode. Called by BT::BehaviorTreeFactory when creating a new behavior tree containing this node. | |
Static Public Member Functions | |
static BT::PortsList | providedPorts () |
static BT::KeyValueVector | metadata () |
Additional Inherited Members | |
![]() | |
std::shared_ptr< BehaviorContext > | shared_resources_ |
This Behavior computes the Cartesian Pose of a link from a given Joint State. If the Joint State message does not contain all of the joints for calculating the pose, it will use the existing joint states for the missing joint states.
Data Port Name | Port Type | Object Type |
---|---|---|
planning_scene | input | moveit_msgs::msg::PlanningScene |
joint_state | input | sensor_msgs::msg::JointState |
link_name | input | std::string |
link_pose | output | geometry_msgs::msg::PoseStamped |
moveit_studio::behaviors::ComputeLinkPoseForwardKinematics::ComputeLinkPoseForwardKinematics | ( | const std::string & | name, |
const BT::NodeConfiguration & | config, | ||
const std::shared_ptr< moveit_studio::behaviors::BehaviorContext > & | shared_resources | ||
) |
tl::expected< geometry_msgs::msg::PoseStamped, std::string > moveit_studio::behaviors::ComputeLinkPoseForwardKinematics::compute_link_pose_forward_kinematics | ( | const moveit_msgs::msg::PlanningScene & | planning_scene, |
const std::shared_ptr< moveit::core::RobotModel > & | robot_model, | ||
const sensor_msgs::msg::JointState & | joint_state_for_fk, | ||
const std::string & | link_name, | ||
const std::shared_ptr< moveit_studio::behaviors::BehaviorContext > & | shared_resources, | ||
InfoAndWarnings & | info_and_warnings | ||
) | const |
|
static |
|
static |
|
override |