$search
#include <kinematic_state.h>
Public Member Functions | |
AttachedBodyState (const KinematicModel::AttachedBodyModel *abm, const LinkState *parent_link_state) | |
void | computeTransform (void) |
Recompute global_collision_body_transform. | |
const KinematicModel::AttachedBodyModel * | getAttachedBodyModel () const |
const std::string & | getAttachedLinkName () const |
const std::vector< btTransform > & | getGlobalCollisionBodyTransforms () const |
const std::string & | getName () const |
~AttachedBodyState () | |
Private Attributes | |
const KinematicModel::AttachedBodyModel * | attached_body_model_ |
std::vector< btTransform > | global_collision_body_transforms_ |
The global transforms for these attached bodies (computed by forward kinematics). | |
const LinkState * | parent_link_state_ |
Definition at line 231 of file kinematic_state.h.
planning_models::KinematicState::AttachedBodyState::AttachedBodyState | ( | const KinematicModel::AttachedBodyModel * | abm, | |
const LinkState * | parent_link_state | |||
) |
Definition at line 552 of file kinematic_state.cpp.
planning_models::KinematicState::AttachedBodyState::~AttachedBodyState | ( | ) | [inline] |
Definition at line 236 of file kinematic_state.h.
void planning_models::KinematicState::AttachedBodyState::computeTransform | ( | void | ) |
Recompute global_collision_body_transform.
Definition at line 563 of file kinematic_state.cpp.
const KinematicModel::AttachedBodyModel* planning_models::KinematicState::AttachedBodyState::getAttachedBodyModel | ( | ) | const [inline] |
Definition at line 250 of file kinematic_state.h.
const std::string& planning_models::KinematicState::AttachedBodyState::getAttachedLinkName | ( | ) | const [inline] |
Definition at line 245 of file kinematic_state.h.
const std::vector<btTransform>& planning_models::KinematicState::AttachedBodyState::getGlobalCollisionBodyTransforms | ( | ) | const [inline] |
Definition at line 258 of file kinematic_state.h.
const std::string& planning_models::KinematicState::AttachedBodyState::getName | ( | void | ) | const [inline] |
Definition at line 240 of file kinematic_state.h.
const KinematicModel::AttachedBodyModel* planning_models::KinematicState::AttachedBodyState::attached_body_model_ [private] |
Definition at line 264 of file kinematic_state.h.
std::vector<btTransform> planning_models::KinematicState::AttachedBodyState::global_collision_body_transforms_ [private] |
The global transforms for these attached bodies (computed by forward kinematics).
Definition at line 269 of file kinematic_state.h.
Definition at line 266 of file kinematic_state.h.