A kinematic group with forward and inverse kinematics methods. More...
#include <tesseract_common/macros.h>
#include <console_bridge/console.h>
#include <tesseract_kinematics/core/kinematic_group.h>
#include <tesseract_kinematics/core/inverse_kinematics.h>
#include <tesseract_kinematics/core/utils.h>
#include <tesseract_common/utils.h>
#include <tesseract_scene_graph/graph.h>
#include <tesseract_scene_graph/joint.h>
#include <tesseract_state_solver/state_solver.h>
Go to the source code of this file.
Namespaces | |
tesseract_kinematics | |
Functions | |
TESSERACT_COMMON_IGNORE_WARNINGS_PUSH TESSERACT_COMMON_IGNORE_WARNINGS_POP std::vector< std::string > | getLinksInFixedJointKinematicTree (const std::string &input_link, const tesseract_scene_graph::SceneGraph &scene_graph) |
Returns the names of the links that comprise a fixed-joint kinematic tree with the input link. More... | |
A kinematic group with forward and inverse kinematics methods.
Definition in file kinematic_group.cpp.
TESSERACT_COMMON_IGNORE_WARNINGS_PUSH TESSERACT_COMMON_IGNORE_WARNINGS_POP std::vector<std::string> getLinksInFixedJointKinematicTree | ( | const std::string & | input_link, |
const tesseract_scene_graph::SceneGraph & | scene_graph | ||
) |
Returns the names of the links that comprise a fixed-joint kinematic tree with the input link.
This method first traverses from the input link "up" the scene graph hierarchy, following the link's in-bound joints, to find the input link's highest level parents that are connected to it by fixed joints. Next, it identifies all the fixed-joint children of these highest level parent links. Together, the highest level parent links and their fixed-joint children comprise a set of links (including the input link), between all of which exists a tree of fixed joints. If the link does not have any fixed-joint parents, the name of the link itself will be returned.
links | |
scene_graph |
Definition at line 51 of file kinematic_group.cpp.