|
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) |
|
Body * | constructBodyFromMsg (const shape_msgs::Mesh &shape, const geometry_msgs::Pose &pose) |
|
Body * | constructBodyFromMsg (const shape_msgs::SolidPrimitive &shape, const geometry_msgs::Pose &pose) |
|
Body * | constructBodyFromMsg (const shapes::ShapeMsg &shape, const geometry_msgs::Pose &pose) |
|
Body * | constructBodyFromMsgHelper (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) |
|
Body * | createBodyFromShape (const shapes::Shape *shape) |
|
Body * | createEmptyBodyFromShapeType (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) |
|