Functions | |
SceneGraph::UPtr | getSceneGraph (const tesseract_common::ResourceLocator &locator) |
SceneGraph::UPtr | getSubSceneGraph () |
static void | numericalJacobian (Eigen::Ref< Eigen::MatrixXd > jacobian, const Eigen::Isometry3d &change_base, const StateSolver &state_solver, const std::vector< std::string > &joint_names, const Eigen::Ref< const Eigen::VectorXd > &joint_values, const std::string &link_name, const Eigen::Ref< const Eigen::Vector3d > &link_point) |
Numerically calculate a jacobian. This is mainly used for testing. More... | |
template<typename S > | |
void | runAddandRemoveLinkTest () |
template<typename S > | |
void | runAddSceneGraphTest () |
template<typename S > | |
void | runChangeJointLimitsTest () |
template<typename S > | |
void | runChangeJointOriginTest () |
void | runCompareJacobian (StateSolver &state_solver, const std::unordered_map< std::string, double > &joints_values, const std::string &link_name, const Eigen::Vector3d &link_point, const Eigen::Isometry3d &change_base) |
void | runCompareJacobian (StateSolver &state_solver, const std::vector< std::string > &joint_names, 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 | runCompareSceneStates (const SceneState &base_state, const SceneState &compare_state) |
void | runCompareStateSolver (const StateSolver &base_solver, StateSolver &comp_solver) |
void | runCompareStateSolverLimits (const SceneGraph &scene_graph, const StateSolver &comp_solver) |
template<typename S > | |
void | runJacobianTest () |
template<typename S > | |
void | runMoveJointTest () |
template<typename S > | |
void | runMoveLinkTest () |
template<typename S > | |
void | runReplaceJointTest () |
template<typename S > | |
void | runSetFloatingJointStateTest () |
|
inline |
Definition at line 22 of file state_solver_test_suite.h.
|
inline |
Definition at line 28 of file state_solver_test_suite.h.
|
inlinestatic |
Numerically calculate a jacobian. This is mainly used for testing.
jacobian | (Return) The jacobian which gets filled out. |
state_solver | The state solver object |
joint_values | The joint values for which to calculate the jacobian |
link_name | The link_name for which the jacobian should be calculated |
link_point | The point on the link for which to calculate the jacobian |
Definition at line 205 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runAddandRemoveLinkTest | ( | ) |
Definition at line 821 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runAddSceneGraphTest | ( | ) |
Definition at line 1099 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runChangeJointLimitsTest | ( | ) |
Definition at line 1588 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runChangeJointOriginTest | ( | ) |
Definition at line 1242 of file state_solver_test_suite.h.
|
inline |
Definition at line 317 of file state_solver_test_suite.h.
|
inline |
Run a kinematic jacobian test.
state_solver | The state solver object |
jvals | The joint values to calculate the jacobian about |
link_name | Name of link to calculate jacobian. If empty it will use the function that does not require link name |
link_point | Is expressed in the same base frame of the jacobian and is a vector from the old point to the new point. |
change_base | The transform from the desired frame to the current base frame of the jacobian |
Definition at line 267 of file state_solver_test_suite.h.
|
inline |
Definition at line 60 of file state_solver_test_suite.h.
|
inline |
Definition at line 87 of file state_solver_test_suite.h.
|
inline |
Definition at line 178 of file state_solver_test_suite.h.
|
inline |
Definition at line 364 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runMoveJointTest | ( | ) |
Definition at line 1339 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runMoveLinkTest | ( | ) |
Definition at line 1458 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runReplaceJointTest | ( | ) |
Definition at line 1686 of file state_solver_test_suite.h.
void tesseract_scene_graph::test_suite::runSetFloatingJointStateTest | ( | ) |
Definition at line 745 of file state_solver_test_suite.h.