Public Member Functions | Private Member Functions | Private Attributes
robot_markers::ForwardKinematics Class Reference

Computes forward kinematics for the robot. More...

#include <forward_kinematics.h>

List of all members.

Public Member Functions

 ForwardKinematics (const urdf::Model &model)
void GetTransforms (const std::map< std::string, double > &joint_positions, std::vector< geometry_msgs::TransformStamped > *transforms) const
void Init ()

Private Member Functions

void AddChildren (const KDL::SegmentMap::const_iterator segment)

Private Attributes

urdf::Model model_
std::map< std::string,
SegmentPair
segments_
KDL::Tree tree_

Detailed Description

Computes forward kinematics for the robot.

Based on code from robot_state_publisher.

Definition at line 26 of file forward_kinematics.h.


Constructor & Destructor Documentation

Constructor.

Parameters:
[in]modelThe URDF model.

Definition at line 19 of file forward_kinematics.cpp.


Member Function Documentation

void robot_markers::ForwardKinematics::AddChildren ( const KDL::SegmentMap::const_iterator  segment) [private]

Definition at line 62 of file forward_kinematics.cpp.

void robot_markers::ForwardKinematics::GetTransforms ( const std::map< std::string, double > &  joint_positions,
std::vector< geometry_msgs::TransformStamped > *  transforms 
) const

Outputs the transforms for each set of joint angles passed in.

If a joint is not part of the URDF, then it is skipped.

Parameters:
[in]joint_positionsThe joint angles to query.
[out]transformsThe transforms, one for each joint angle.

Definition at line 27 of file forward_kinematics.cpp.

Initializes the forward kinematics.

This should be called before calling any other methods.

Definition at line 22 of file forward_kinematics.cpp.


Member Data Documentation

Definition at line 49 of file forward_kinematics.h.

std::map<std::string, SegmentPair> robot_markers::ForwardKinematics::segments_ [private]

Definition at line 51 of file forward_kinematics.h.

Definition at line 50 of file forward_kinematics.h.


The documentation for this class was generated from the following files:


robot_markers
Author(s):
autogenerated on Sat Jun 8 2019 20:39:25