moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces
lma_kinematics_plugin.h File Reference
#include <rclcpp/rclcpp.hpp>
#include <random_numbers/random_numbers.h>
#include <geometry_msgs/msg/pose.hpp>
#include <moveit_msgs/srv/get_position_fk.hpp>
#include <moveit_msgs/srv/get_position_ik.hpp>
#include <moveit_msgs/msg/kinematic_solver_info.hpp>
#include <moveit_msgs/msg/move_it_error_codes.hpp>
#include <kdl/config.h>
#include <kdl/chainfksolver.hpp>
#include <kdl/chainiksolver.hpp>
#include <moveit/kinematics_base/kinematics_base.h>
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/robot_state.h>
Include dependency graph for lma_kinematics_plugin.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  lma_kinematics_plugin::LMAKinematicsPlugin
 Implementation of kinematics using Levenberg-Marquardt (LMA) solver from KDL. This version supports any kinematic chain without mimic joints. More...
 

Namespaces

 lma_kinematics_plugin