|
tesseract_scene_graph::SceneGraph::UPtr | getSceneGraphIIWA () |
|
tesseract_scene_graph::SceneGraph::UPtr | getSceneGraphABBExternalPositioner () |
|
tesseract_scene_graph::SceneGraph::UPtr | getSceneGraphABBOnPositioner () |
|
tesseract_scene_graph::SceneGraph::UPtr | getSceneGraphABB () |
|
tesseract_scene_graph::SceneGraph::UPtr | getSceneGraphIIWA7 () |
|
tesseract_scene_graph::SceneGraph::UPtr | getSceneGraphUR (const tesseract_kinematics::URParameters ¶ms, double shoulder_offset, double elbow_offset) |
|
tesseract_common::KinematicLimits | getTargetLimits (const tesseract_scene_graph::SceneGraph &scene_graph, const std::vector< std::string > &joint_names) |
|
void | runJacobianTest (tesseract_kinematics::ForwardKinematics &kin, const Eigen::VectorXd &jvals, const std::string &link_name, const Eigen::Vector3d &link_point, const Eigen::Isometry3d &change_base) |
| Run a kinematic jacobian test. More...
|
|
void | runJacobianTest (tesseract_kinematics::KinematicGroup &kin_group, const Eigen::VectorXd &jvals, const std::string &link_name, const Eigen::Vector3d &link_point) |
| Run a kinematic jacobian test. More...
|
|
void | runKinJointLimitsTest (const tesseract_common::KinematicLimits &limits, const tesseract_common::KinematicLimits &target_limits) |
| Run kinematic limits test. More...
|
|
void | runKinSetJointLimitsTest (tesseract_kinematics::KinematicGroup &kin_group) |
| Run kinematics setJointLimits function test. More...
|
|
void | runStringVectorEqualTest (const std::vector< std::string > &names, const std::vector< std::string > &target_names) |
| Check if two vectors of strings are equal but ignore order. More...
|
|
void | runInvKinTest (const tesseract_kinematics::InverseKinematics &inv_kin, const tesseract_kinematics::ForwardKinematics &fwd_kin, const Eigen::Isometry3d &target_pose, const std::string &tip_link_name, const Eigen::VectorXd &seed) |
| Run inverse kinematics test comparing the inverse solution to the forward solution. More...
|
|
void | runInvKinTest (const tesseract_kinematics::KinematicGroup &kin_group, const Eigen::Isometry3d &target_pose, const std::string &working_frame, const std::string &tip_link_name, const Eigen::VectorXd &seed) |
| Run inverse kinematics test comparing the inverse solution to the forward solution. More...
|
|
void | runFwdKinIIWATest (tesseract_kinematics::ForwardKinematics &kin) |
|
void | runJacobianIIWATest (tesseract_kinematics::ForwardKinematics &kin, bool is_kin_tree=false) |
|
void | runKinGroupJacobianIIWATest (tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runActiveLinkNamesIIWATest (const tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runActiveLinkNamesABBTest (const tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runActiveLinkNamesURTest (const tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runKinGroupJacobianABBOnPositionerTest (tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runActiveLinkNamesABBOnPositionerTest (const tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runKinGroupJacobianABBExternalPositionerTest (tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runActiveLinkNamesABBExternalPositionerTest (const tesseract_kinematics::KinematicGroup &kin_group) |
|
void | runInvKinIIWATest (const tesseract_kinematics::KinematicsPluginFactory &factory, const std::string &inv_factory_name, const std::string &fwd_factory_name) |
|