|
const std::vector< std::string > & | getJointNames () const |
| Return all the joint names in the order they are used internally. More...
|
|
const std::vector< std::string > & | getLinkNames () const |
| Return all the link names in the order they are represented internally. More...
|
|
virtual bool | getPositionFK (const std::vector< std::string > &link_names, const std::vector< double > &joint_angles, std::vector< geometry_msgs::Pose > &poses) const |
| Given a set of joint angles and a set of links, compute their pose. More...
|
|
virtual bool | getPositionIK (const geometry_msgs::Pose &ik_pose, const std::vector< double > &ik_seed_state, std::vector< double > &solution, moveit_msgs::MoveItErrorCodes &error_code, const kinematics::KinematicsQueryOptions &options=kinematics::KinematicsQueryOptions()) const |
| Given a desired pose of the end-effector, compute the joint angles to reach it. More...
|
|
virtual bool | initialize (const std::string &robot_description, const std::string &group_name, const std::string &base_name, const std::string &tip_name, double search_discretization) |
| Initialization function for the kinematics. More...
|
|
bool | isActive () |
| Specifies if the node is active or not. More...
|
|
| PR2ArmKinematicsPlugin () |
|
virtual bool | searchPositionIK (const geometry_msgs::Pose &ik_pose, const std::vector< double > &ik_seed_state, double timeout, std::vector< double > &solution, moveit_msgs::MoveItErrorCodes &error_code, const kinematics::KinematicsQueryOptions &options=kinematics::KinematicsQueryOptions()) const |
| Given a desired pose of the end-effector, search for the joint angles required to reach it. This particular method is intended for "searching" for a solutions by stepping through the redundancy (or other numerical routines). More...
|
|
virtual bool | searchPositionIK (const geometry_msgs::Pose &ik_pose, const std::vector< double > &ik_seed_state, double timeout, const std::vector< double > &consistency_limits, std::vector< double > &solution, moveit_msgs::MoveItErrorCodes &error_code, const kinematics::KinematicsQueryOptions &options=kinematics::KinematicsQueryOptions()) const |
| Given a desired pose of the end-effector, search for the joint angles required to reach it. This particular method is intended for "searching" for a solutions by stepping through the redundancy (or other numerical routines). More...
|
|
virtual bool | searchPositionIK (const geometry_msgs::Pose &ik_pose, const std::vector< double > &ik_seed_state, double timeout, std::vector< double > &solution, const IKCallbackFn &solution_callback, moveit_msgs::MoveItErrorCodes &error_code, const kinematics::KinematicsQueryOptions &options=kinematics::KinematicsQueryOptions()) const |
| Given a desired pose of the end-effector, search for the joint angles required to reach it. This particular method is intended for "searching" for a solutions by stepping through the redundancy (or other numerical routines). More...
|
|
virtual bool | searchPositionIK (const geometry_msgs::Pose &ik_pose, const std::vector< double > &ik_seed_state, double timeout, const std::vector< double > &consistency_limits, std::vector< double > &solution, const IKCallbackFn &solution_callback, moveit_msgs::MoveItErrorCodes &error_code, const kinematics::KinematicsQueryOptions &options=kinematics::KinematicsQueryOptions()) const |
| Given a desired pose of the end-effector, search for the joint angles required to reach it. This particular method is intended for "searching" for a solutions by stepping through the redundancy (or other numerical routines). The consistency_limit specifies that only certain redundancy positions around those specified in the seed state are admissible and need to be searched. More...
|
|
void | setRobotModel (urdf::ModelInterfaceSharedPtr &robot_model) |
|
virtual const std::string & | getBaseFrame () const |
| Return the name of the frame in which the solver is operating. This is usually a link name. No namespacing (e.g., no "/" prefix) should be used. More...
|
|
double | getDefaultTimeout () const |
| For functions that require a timeout specified but one is not specified using arguments, this default timeout is used. More...
|
|
virtual const std::string & | getGroupName () const |
| Return the name of the group that the solver is operating on. More...
|
|
virtual bool | getPositionIK (const std::vector< geometry_msgs::Pose > &ik_poses, const std::vector< double > &ik_seed_state, std::vector< std::vector< double > > &solutions, KinematicsResult &result, const kinematics::KinematicsQueryOptions &options) const |
| Given a desired pose of the end-effector, compute the set joint angles solutions that are able to reach it. More...
|
|
virtual void | getRedundantJoints (std::vector< unsigned int > &redundant_joint_indices) const |
| Get the set of redundant joints. More...
|
|
double | getSearchDiscretization (int joint_index=0) const |
| Get the value of the search discretization. More...
|
|
std::vector< DiscretizationMethod > | getSupportedDiscretizationMethods () const |
| Returns the set of supported kinematics discretization search types. This implementation only supports the DiscretizationMethods::ONE search. More...
|
|
virtual const std::string & | getTipFrame () const |
| Return the name of the tip frame of the chain on which the solver is operating. This is usually a link name. No namespacing (e.g., no "/" prefix) should be used. Deprecated in favor of getTipFrames(), but will remain for foreseeable future for backwards compatibility. More...
|
|
virtual const std::vector< std::string > & | getTipFrames () const |
| Return the names of the tip frames of the kinematic tree on which the solver is operating. This is usually a link name. No namespacing (e.g., no "/" prefix) should be used. More...
|
|
virtual bool | initialize (const std::string &robot_description, const std::string &group_name, const std::string &base_frame, const std::vector< std::string > &tip_frames, double search_discretization) |
| Initialization function for the kinematics, for use with non-chain IK solvers. More...
|
|
| KinematicsBase () |
|
virtual bool | searchPositionIK (const std::vector< geometry_msgs::Pose > &ik_poses, const std::vector< double > &ik_seed_state, double timeout, const std::vector< double > &consistency_limits, std::vector< double > &solution, const IKCallbackFn &solution_callback, moveit_msgs::MoveItErrorCodes &error_code, const kinematics::KinematicsQueryOptions &options=kinematics::KinematicsQueryOptions(), const moveit::core::RobotState *context_state=NULL) const |
| Given a set of desired poses for a planning group with multiple end-effectors, search for the joint angles required to reach them. This is useful for e.g. biped robots that need to perform whole-body IK. Not necessary for most robots that have kinematic chains. This particular method is intended for "searching" for a solutions by stepping through the redundancy (or other numerical routines). More...
|
|
void | setDefaultTimeout (double timeout) |
| For functions that require a timeout specified but one is not specified using arguments, a default timeout is used, as set by this function (and initialized to KinematicsBase::DEFAULT_TIMEOUT) More...
|
|
virtual bool | setRedundantJoints (const std::vector< unsigned int > &redundant_joint_indices) |
| Set a set of redundant joints for the kinematics solver to use. This can fail, depending on the IK solver and choice of redundant joints!. Also, it sets the discretization values for each redundant joint to a default value. More...
|
|
bool | setRedundantJoints (const std::vector< std::string > &redundant_joint_names) |
| Set a set of redundant joints for the kinematics solver to use. This function is just a convenience function that calls the previous definition of setRedundantJoints() More...
|
|
void | setSearchDiscretization (double sd) |
| Set the search discretization value for all the redundant joints. More...
|
|
void | setSearchDiscretization (const std::map< int, double > &discretization) |
| Sets individual discretization values for each redundant joint. More...
|
|
virtual void | setValues (const std::string &robot_description, const std::string &group_name, const std::string &base_frame, const std::string &tip_frame, double search_discretization) |
| Set the parameters for the solver, for use with kinematic chain IK solvers. More...
|
|
virtual void | setValues (const std::string &robot_description, const std::string &group_name, const std::string &base_frame, const std::vector< std::string > &tip_frames, double search_discretization) |
| Set the parameters for the solver, for use with non-chain IK solvers. More...
|
|
virtual bool | supportsGroup (const moveit::core::JointModelGroup *jmg, std::string *error_text_out=NULL) const |
| Check if this solver supports a given JointModelGroup. More...
|
|
virtual | ~KinematicsBase () |
| Virtual destructor for the interface. More...
|
|