Only released in EOL distros:
Package Summary
arm_kinematics_constraint_aware
- Author: Sachin Chitta
- License: BSD
- Repository: wg-ros-pkg
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/kinematics/tags/kinematics-0.3.3
Package Summary
arm_kinematics_constraint_aware
- Author: Sachin Chitta
- License: BSD
- Source: hg https://kforge.ros.org/armnavigation/armnavigation (branch: electric_patches)
kinematics: arm_kinematics_constraint_aware | kinematics_base | kinematics_msgs
Package Summary
arm_kinematics_constraint_aware
- Author: Sachin Chitta
- License: BSD
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/kinematics/trunk
Package Summary
arm_kinematics_constraint_aware
- Author: Sachin Chitta
- License: BSD
- Source: hg https://kforge.ros.org/armnavigation/armnavigation (branch: default)
Contents
This package provides a generic implementation of constraint aware kinematics for any serial manipulator. It is based on a combination of the ROS collision checking tools with KDL forward and inverse kinematics solvers. This package exposes this functionality in three ways:
C++ class: A C++ interface through a class that inherits from the base class provided in the kinematics_base package.
ROS plugin interface: This interface allows other programs to configure and use this implementation of kinematics at runtime. The configuration is done through yaml and is described in more detail in the tutorials for setting up a node.
A ROS node: This node has the same ROS API as the node provided by the pr2_arm_kinematics_constraint_aware package. It can use the plugin from this package or a custom plugin created for a specific robot.
Configuration for your own arm
Follow the tutorials for configuring this node for your own arm.