Namespaces | Classes | Typedefs | Functions
bodies Namespace Reference

Namespaces

 detail
 

Classes

class  AABB
 
class  Body
 
class  BodyVector
 
struct  BoundingCylinder
 
struct  BoundingSphere
 
class  Box
 
class  ConvexMesh
 
class  Cylinder
 
class  OBB
 
class  OBBPrivate
 
class  Sphere
 

Typedefs

typedef bodies::AABB AxisAlignedBoundingBox
 
typedef std::shared_ptr< const BodyBodyConstPtr
 
typedef std::shared_ptr< BodyBodyPtr
 
typedef bodies::OBB OrientedBoundingBox
 

Functions

void computeBoundingBoxAt (const bodies::Body *body, AxisAlignedBoundingBox &bbox, const Eigen::Isometry3d &pose)
 Compute AABB for the body at different pose. Can't use setPose() because we want body to be const. More...
 
void computeBoundingSphere (const std::vector< const Body * > &bodies, BoundingSphere &mergedSphere)
 
BodyconstructBodyFromMsg (const shape_msgs::Mesh &shape, const geometry_msgs::Pose &pose)
 
BodyconstructBodyFromMsg (const shape_msgs::SolidPrimitive &shape, const geometry_msgs::Pose &pose)
 
BodyconstructBodyFromMsg (const shapes::ShapeMsg &shape, const geometry_msgs::Pose &pose)
 
BodyconstructBodyFromMsgHelper (const T &shape_msg, const geometry_msgs::Pose &pose)
 
void constructMarkerFromBody (const bodies::Body *body, visualization_msgs::Marker &msg)
 
shapes::ShapeConstPtr constructShapeFromBody (const bodies::Body *body)
 
BodycreateBodyFromShape (const shapes::Shape *shape)
 
BodycreateEmptyBodyFromShapeType (const shapes::ShapeType &shapeType)
 
void mergeBoundingBoxes (const std::vector< AABB > &boxes, AABB &mergedBox)
 
void mergeBoundingBoxesApprox (const std::vector< OBB > &boxes, OBB &mergedBox)
 
void mergeBoundingSpheres (const std::vector< BoundingSphere > &spheres, BoundingSphere &mergedSphere)
 
Eigen::Vector3d normalize (const Eigen::Vector3d &dir)
 

Typedef Documentation

◆ AxisAlignedBoundingBox

Definition at line 18 of file bodies.h.

◆ OrientedBoundingBox

Definition at line 19 of file bodies.h.

Function Documentation

◆ computeBoundingBoxAt()

void bodies::computeBoundingBoxAt ( const bodies::Body body,
AxisAlignedBoundingBox bbox,
const Eigen::Isometry3d &  pose 
)

Compute AABB for the body at different pose. Can't use setPose() because we want body to be const.

Definition at line 9 of file bodies.cpp.



robot_body_filter
Author(s): Eitan Marder-Eppstein, Tomas Petricek, Martin Pecka
autogenerated on Mon Feb 5 2024 03:33:49