#include <ros/ros.h>#include <moveit/kinematics_base/kinematics_base.h>#include <tf_conversions/tf_kdl.h>#include "ikfast.h"#include <moveit_msgs/GetKinematicSolverInfo.h>#include <moveit_msgs/MoveItErrorCodes.h>#include <urdf/model.h>#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Classes | |
| class | IKFAST_NAMESPACE::IKFastPlugin |
| class | IkSolutionListFiltered |
| struct | JointSpaceStepper |
| struct | Stepper |
Namespaces | |
| namespace | IKFAST_NAMESPACE |
Defines | |
| #define | ADD_IKFAST_PLUGIN(name) ADD_TYPED_PLUGIN(IKFast_, name) |
| #define | ADD_TYPED_PLUGIN(type, name) PLUGINLIB_DECLARE_CLASS(cob_kinematics, type##name, IKFAST_NAMESPACE::IKFastPlugin, kinematics::KinematicsBase) |
| #define | IKFAST_HAS_LIBRARY |
| #define | IKFAST_NO_MAIN |
Functions | |
| template<class A1 , class A2 > | |
| std::ostream & | operator<< (std::ostream &s, std::vector< A1, A2 > const &vec) |
| void | print_frame (const char *str, const double *trans, const double *rot) |
| void | setConsistencyLimit (std::vector< std::pair< double, double > > &min_max, const std::vector< double > &seed, const std::vector< double > &consistency_limits) |
| #define ADD_IKFAST_PLUGIN | ( | name | ) | ADD_TYPED_PLUGIN(IKFast_, name) |
Definition at line 517 of file ikfast_plugin.cpp.
| #define ADD_TYPED_PLUGIN | ( | type, | |
| name | |||
| ) | PLUGINLIB_DECLARE_CLASS(cob_kinematics, type##name, IKFAST_NAMESPACE::IKFastPlugin, kinematics::KinematicsBase) |
Definition at line 516 of file ikfast_plugin.cpp.
| #define IKFAST_HAS_LIBRARY |
Definition at line 24 of file ikfast_plugin.cpp.
| #define IKFAST_NO_MAIN |
Definition at line 25 of file ikfast_plugin.cpp.
| std::ostream& operator<< | ( | std::ostream & | s, |
| std::vector< A1, A2 > const & | vec | ||
| ) |
Definition at line 120 of file ikfast_plugin.cpp.
| void print_frame | ( | const char * | str, |
| const double * | trans, | ||
| const double * | rot | ||
| ) |
Definition at line 32 of file ikfast_plugin.cpp.
| void setConsistencyLimit | ( | std::vector< std::pair< double, double > > & | min_max, |
| const std::vector< double > & | seed, | ||
| const std::vector< double > & | consistency_limits | ||
| ) |
Definition at line 35 of file ikfast_plugin.cpp.