Namespaces | Classes | Typedefs | Functions | Variables
moveit::core Namespace Reference

Namespaces

 JointModelGroup
 

Classes

class  AABB
 
class  AttachedBody
 
class  FixedJointModel
 
class  FloatingJointModel
 
class  JointModel
 
class  JointModelGroup
 
struct  JumpThreshold
 
class  LinkModel
 
struct  MaxEEFStep
 
class  PlanarJointModel
 
class  PrismaticJointModel
 
class  RevoluteJointModel
 
class  RobotModel
 
class  RobotState
 
class  Transforms
 
struct  VariableBounds
 

Typedefs

typedef boost::function< void(AttachedBody *body, bool attached)> AttachedBodyCallback
 
typedef std::map< std::string, Eigen::Affine3d, std::less< std::string >, Eigen::aligned_allocator< std::pair< const std::string, Eigen::Affine3d > > > FixedTransformsMap
 
typedef boost::function< bool(RobotState *robot_state, const JointModelGroup *joint_group, const double *joint_group_variable_values)> GroupStateValidityCallbackFn
 
typedef std::vector< const JointModel::Bounds * > JointBoundsVector
 
typedef std::map< std::string, JointModelGroup * > JointModelGroupMap
 
typedef std::map< std::string, const JointModelGroup * > JointModelGroupMapConst
 
typedef std::map< std::string, JointModel * > JointModelMap
 
typedef std::map< std::string, const JointModel * > JointModelMapConst
 
typedef std::map< std::string, LinkModel * > LinkModelMap
 
typedef std::map< std::string, const LinkModel * > LinkModelMapConst
 
typedef std::map< const LinkModel *, Eigen::Affine3d, std::less< const LinkModel * >, Eigen::aligned_allocator< std::pair< const LinkModel *const, Eigen::Affine3d > > > LinkTransformMap
 
typedef boost::function< kinematics::KinematicsBasePtr(const JointModelGroup *)> SolverAllocatorFn
 
typedef std::map< const JointModelGroup *, SolverAllocatorFnSolverAllocatorMapFn
 
typedef std::map< std::string, VariableBoundsVariableBoundsMap
 
typedef std::map< std::string, int > VariableIndexMap
 

Functions

void attachedBodiesToAttachedCollisionObjectMsgs (const std::vector< const AttachedBody * > &attached_bodies, std::vector< moveit_msgs::AttachedCollisionObject > &attached_collision_objs)
 
bool jointStateToRobotState (const sensor_msgs::JointState &joint_state, RobotState &state)
 
bool jointTrajPointToRobotState (const trajectory_msgs::JointTrajectory &trajectory, std::size_t point_id, RobotState &state)
 
 MOVEIT_CLASS_FORWARD (Transforms)
 
 MOVEIT_CLASS_FORWARD (RobotState)
 
 MOVEIT_CLASS_FORWARD (RobotModel)
 
std::ostream & operator<< (std::ostream &out, const RobotState &s)
 
std::ostream & operator<< (std::ostream &out, const VariableBounds &b)
 
bool robotStateMsgToRobotState (const Transforms &tf, const moveit_msgs::RobotState &robot_state, RobotState &state, bool copy_attached_bodies=true)
 
bool robotStateMsgToRobotState (const moveit_msgs::RobotState &robot_state, RobotState &state, bool copy_attached_bodies=true)
 
void robotStateToJointStateMsg (const RobotState &state, sensor_msgs::JointState &joint_state)
 
void robotStateToRobotStateMsg (const RobotState &state, moveit_msgs::RobotState &robot_state, bool copy_attached_bodies=true)
 
void robotStateToStream (const RobotState &state, std::ostream &out, bool include_header=true, const std::string &separator=",")
 
void robotStateToStream (const RobotState &state, std::ostream &out, const std::vector< std::string > &joint_groups_ordering, bool include_header=true, const std::string &separator=",")
 
void streamToRobotState (RobotState &state, const std::string &line, const std::string &separator=",")
 
double toDouble (const std::string &s)
 
float toFloat (const std::string &s)
 
OutType toRealImpl (const std::string &s)
 
std::string toString (float f)
 
std::string toString (double d)
 
std::string toStringImpl (InType t)
 

Variables

const std::string LOGNAME
 
static const std::size_t MIN_STEPS_FOR_JUMP_THRESH
 


robot_interaction
Author(s): Ioan Sucan
autogenerated on Wed Jul 10 2019 04:04:01