Public Member Functions | Private Attributes
moveit::core::PlanarJointModel Class Reference

A planar joint. More...

#include <planar_joint_model.h>

Inheritance diagram for moveit::core::PlanarJointModel:
Inheritance graph
[legend]

List of all members.

Public Member Functions

virtual void computeTransform (const double *joint_values, Eigen::Affine3d &transf) const
 Given the joint values for a joint, compute the corresponding transform.
virtual void computeVariablePositions (const Eigen::Affine3d &transf, double *joint_values) const
 Given the transform generated by joint, compute the corresponding joint values.
virtual double distance (const double *values1, const double *values2) const
 Compute the distance between two joint states of the same model (represented by the variable values)
virtual bool enforcePositionBounds (double *values, const Bounds &other_bounds) const
 Force the specified values to be inside bounds and normalized. Quaternions are normalized, continuous joints are made between -Pi and Pi. Return true if changes were made.
double getAngularDistanceWeight () const
virtual double getMaximumExtent (const Bounds &other_bounds) const
 Get the extent of the state space (the maximum value distance() can ever report)
virtual unsigned int getStateSpaceDimension () const
 Get the dimension of the state space that corresponds to this joint.
virtual void getVariableDefaultPositions (double *values, const Bounds &other_bounds) const
 Provide a default value for the joint given the joint variable bounds. Most joints will use the default implementation provided in this base class, but the quaternion for example needs a different implementation. Enough memory is assumed to be allocated.
virtual void getVariableRandomPositions (random_numbers::RandomNumberGenerator &rng, double *values, const Bounds &other_bounds) const
 Provide random values for the joint variables (within specified bounds). Enough memory is assumed to be allocated.
virtual void getVariableRandomPositionsNearBy (random_numbers::RandomNumberGenerator &rng, double *values, const Bounds &other_bounds, const double *near, const double distance) const
 Provide random values for the joint variables (within specified bounds). Enough memory is assumed to be allocated.
virtual void interpolate (const double *from, const double *to, const double t, double *state) const
 Computes the state that lies at time t in [0, 1] on the segment that connects from state to to state. The memory location of state is not required to be different from the memory of either from or to.
bool normalizeRotation (double *values) const
 PlanarJointModel (const std::string &name)
virtual bool satisfiesPositionBounds (const double *values, const Bounds &other_bounds, double margin) const
 Check if the set of position values for the variables of this joint are within bounds, up to some margin.
void setAngularDistanceWeight (double weight)

Private Attributes

double angular_distance_weight_

Detailed Description

A planar joint.

Definition at line 47 of file planar_joint_model.h.


Constructor & Destructor Documentation

moveit::core::PlanarJointModel::PlanarJointModel ( const std::string &  name)

Definition at line 43 of file planar_joint_model.cpp.


Member Function Documentation

void moveit::core::PlanarJointModel::computeTransform ( const double *  joint_values,
Eigen::Affine3d &  transf 
) const [virtual]

Given the joint values for a joint, compute the corresponding transform.

Implements moveit::core::JointModel.

Definition at line 215 of file planar_joint_model.cpp.

void moveit::core::PlanarJointModel::computeVariablePositions ( const Eigen::Affine3d &  transform,
double *  joint_values 
) const [virtual]

Given the transform generated by joint, compute the corresponding joint values.

Implements moveit::core::JointModel.

Definition at line 221 of file planar_joint_model.cpp.

double moveit::core::PlanarJointModel::distance ( const double *  value1,
const double *  value2 
) const [virtual]

Compute the distance between two joint states of the same model (represented by the variable values)

Implements moveit::core::JointModel.

Definition at line 164 of file planar_joint_model.cpp.

bool moveit::core::PlanarJointModel::enforcePositionBounds ( double *  values,
const Bounds other_bounds 
) const [virtual]

Force the specified values to be inside bounds and normalized. Quaternions are normalized, continuous joints are made between -Pi and Pi. Return true if changes were made.

Implements moveit::core::JointModel.

Definition at line 196 of file planar_joint_model.cpp.

Definition at line 69 of file planar_joint_model.h.

double moveit::core::PlanarJointModel::getMaximumExtent ( const Bounds other_bounds) const [virtual]

Get the extent of the state space (the maximum value distance() can ever report)

Implements moveit::core::JointModel.

Definition at line 77 of file planar_joint_model.cpp.

Get the dimension of the state space that corresponds to this joint.

Implements moveit::core::JointModel.

Definition at line 72 of file planar_joint_model.cpp.

void moveit::core::PlanarJointModel::getVariableDefaultPositions ( double *  values,
const Bounds other_bounds 
) const [virtual]

Provide a default value for the joint given the joint variable bounds. Most joints will use the default implementation provided in this base class, but the quaternion for example needs a different implementation. Enough memory is assumed to be allocated.

Implements moveit::core::JointModel.

Definition at line 84 of file planar_joint_model.cpp.

void moveit::core::PlanarJointModel::getVariableRandomPositions ( random_numbers::RandomNumberGenerator rng,
double *  values,
const Bounds other_bounds 
) const [virtual]

Provide random values for the joint variables (within specified bounds). Enough memory is assumed to be allocated.

Implements moveit::core::JointModel.

Definition at line 97 of file planar_joint_model.cpp.

void moveit::core::PlanarJointModel::getVariableRandomPositionsNearBy ( random_numbers::RandomNumberGenerator rng,
double *  values,
const Bounds other_bounds,
const double *  near,
const double  distance 
) const [virtual]

Provide random values for the joint variables (within specified bounds). Enough memory is assumed to be allocated.

Implements moveit::core::JointModel.

Definition at line 113 of file planar_joint_model.cpp.

void moveit::core::PlanarJointModel::interpolate ( const double *  from,
const double *  to,
const double  t,
double *  state 
) const [virtual]

Computes the state that lies at time t in [0, 1] on the segment that connects from state to to state. The memory location of state is not required to be different from the memory of either from or to.

Implements moveit::core::JointModel.

Definition at line 138 of file planar_joint_model.cpp.

bool moveit::core::PlanarJointModel::normalizeRotation ( double *  values) const

Make the yaw component of a state's value vector be in the range [-Pi, Pi]. enforceBounds() also calls this function; Return true if a change is actually made

Definition at line 183 of file planar_joint_model.cpp.

bool moveit::core::PlanarJointModel::satisfiesPositionBounds ( const double *  values,
const Bounds other_bounds,
double  margin 
) const [virtual]

Check if the set of position values for the variables of this joint are within bounds, up to some margin.

Implements moveit::core::JointModel.

Definition at line 174 of file planar_joint_model.cpp.

Definition at line 74 of file planar_joint_model.h.


Member Data Documentation

Definition at line 85 of file planar_joint_model.h.


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


moveit_core
Author(s): Ioan Sucan , Sachin Chitta , Acorn Pooley
autogenerated on Mon Jul 24 2017 02:20:45