|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <rclcpp/rclcpp.hpp>#include <memory>#include <geometry_msgs/msg/pose.hpp>#include <moveit_msgs/msg/kinematic_solver_info.hpp>#include <moveit_msgs/msg/move_it_error_codes.hpp>#include <moveit/kinematics_base/kinematics_base.hpp>#include <moveit/robot_state/robot_state.hpp>#include <moveit_kinematics/srv_kinematics_parameters.hpp>

Go to the source code of this file.
Classes | |
| class | srv_kinematics_plugin::SrvKinematicsPlugin |
| Specific implementation of kinematics using ROS service calls to communicate with external IK solvers. This version can be used with any robot. Supports non-chain kinematic groups. More... | |
Namespaces | |
| namespace | srv_kinematics_plugin |