Namespaces | Classes | Typedefs | Enumerations | Functions
tesseract_scene_graph Namespace Reference

Namespaces

 test_suite
 

Classes

struct  adjacency_detector
 
struct  children_detector
 
class  Collision
 
struct  cycle_detector
 
class  Inertial
 
class  Joint
 
class  JointCalibration
 
class  JointDynamics
 
class  JointLimits
 
class  JointMimic
 
class  JointSafety
 
struct  kdl_sub_tree_builder
 
struct  kdl_tree_builder
 
class  KDLStateSolver
 
struct  KDLTreeData
 
class  Link
 
class  Material
 
class  MutableStateSolver
 A mutable state solver allows you to reconfigure the solver's links and joints. More...
 
struct  ofkt_builder
 Every time a vertex is visited for the first time add a new node to the tree. More...
 
class  OFKTBaseNode
 
class  OFKTContinuousNode
 
class  OFKTFixedNode
 
class  OFKTFloatingNode
 
class  OFKTNode
 The OFKT node is contains multiple trasformation which are described below. More...
 
class  OFKTPrismaticNode
 
class  OFKTRevoluteNode
 
class  OFKTRootNode
 
class  OFKTStateSolver
 An implementation of the Optimized Forward Kinematic Tree as a stat solver. More...
 
class  SceneGraph
 
struct  SceneState
 
struct  ShortestPath
 
class  StateSolver
 
struct  tree_detector
 
struct  ugraph_vertex_copier
 
class  Visual
 

Typedefs

typedef boost::property< boost::edge_joint_t, std::shared_ptr< Joint >, boost::property< boost::edge_weight_t, double > > EdgeProperty
 
typedef boost::adjacency_list< boost::listS, boost::listS, boost::bidirectionalS, VertexProperty, EdgeProperty, GraphPropertyGraph
 
typedef boost::property< boost::graph_name_t, std::string, boost::property< boost::graph_root_t, std::string > > GraphProperty
 
typedef boost::adjacency_list< boost::listS, boost::listS, boost::undirectedS, VertexProperty, EdgeProperty, GraphPropertyUGraph
 
typedef boost::property< boost::vertex_link_t, std::shared_ptr< Link >, boost::property< boost::vertex_link_visible_t, bool, boost::property< boost::vertex_link_collision_enabled_t, bool > >> VertexProperty
 

Enumerations

enum  JointType {
  JointType::UNKNOWN, JointType::REVOLUTE, JointType::CONTINUOUS, JointType::PRISMATIC,
  JointType::FLOATING, JointType::PLANAR, JointType::FIXED
}
 

Functions

KDL::Frame convert (const Eigen::Isometry3d &transform)
 
KDL::Jacobian convert (const Eigen::MatrixXd &jacobian)
 
KDL::Vector convert (const Eigen::Vector3d &vector)
 
Eigen::Isometry3d convert (const KDL::Frame &frame)
 
Eigen::MatrixXd convert (const KDL::Jacobian &jacobian)
 
Eigen::MatrixXd convert (const KDL::Jacobian &jacobian, const std::vector< int > &q_nrs)
 
Eigen::Vector3d convert (const KDL::Vector &vector)
 
KDL::RigidBodyInertia convert (const std::shared_ptr< const Inertial > &inertial)
 
KDL::Joint convert (const std::shared_ptr< const Joint > &joint)
 
std::ostream & operator<< (std::ostream &os, const JointCalibration &calibration)
 
std::ostream & operator<< (std::ostream &os, const JointDynamics &dynamics)
 
std::ostream & operator<< (std::ostream &os, const JointLimits &limits)
 
std::ostream & operator<< (std::ostream &os, const JointMimic &mimic)
 
std::ostream & operator<< (std::ostream &os, const JointSafety &safety)
 
std::ostream & operator<< (std::ostream &os, const JointType &type)
 
std::ostream & operator<< (std::ostream &os, const ShortestPath &path)
 
KDLTreeData parseSceneGraph (const SceneGraph &scene_graph)
 
KDLTreeData parseSceneGraph (const SceneGraph &scene_graph, const std::vector< std::string > &joint_names, const std::unordered_map< std::string, double > &joint_values, const tesseract_common::TransformMap &floating_joint_values={})
 


tesseract_state_solver
Author(s): Levi Armstrong
autogenerated on Sun May 18 2025 03:02:10