geometric_shapes
C++ API
Class Hierarchy
File Hierarchy
Full C++ API
Namespaces
Namespace bodies
Namespace Eigen
Namespace geometric_shapes
Namespace octomap
Namespace shapes
Classes and Structs
Struct BoundingCylinder
Struct BoundingSphere
Class AABB
Class Body
Class BodyVector
Class Box
Class ConvexMesh
Class Cylinder
Class OBB
Class Sphere
Class Box
Class Cone
Class Cylinder
Class Mesh
Class OcTree
Class Plane
Class Shape
Class Sphere
Enums
Enum ShapeType
Functions
Function bodies::computeBoundingSphere
Function bodies::constructBodyFromMsg(const shape_msgs::msg::Mesh&, const geometry_msgs::msg::Pose&)
Function bodies::constructBodyFromMsg(const shape_msgs::msg::SolidPrimitive&, const geometry_msgs::msg::Pose&)
Function bodies::constructBodyFromMsg(const shapes::ShapeMsg&, const geometry_msgs::msg::Pose&)
Function bodies::constructMarkerFromBody
Function bodies::constructShapeFromBody
Function bodies::createBodyFromShape
Function bodies::createEmptyBodyFromShapeType
Function bodies::mergeBoundingBoxes
Function bodies::mergeBoundingBoxesApprox
Function bodies::mergeBoundingSpheres
Function checkIsometry
Function geometric_shapes::constructMarkerFromShape(const shape_msgs::msg::Mesh&, visualization_msgs::msg::Marker&, bool)
Function geometric_shapes::constructMarkerFromShape(const shape_msgs::msg::SolidPrimitive&, visualization_msgs::msg::Marker&)
Function geometric_shapes::getShapeExtents(const shape_msgs::msg::SolidPrimitive&, double&, double&, double&)
Function geometric_shapes::getShapeExtents(const shape_msgs::msg::Mesh&, double&, double&, double&)
Template Function geometric_shapes::solidPrimitiveDimCount
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::BOX >
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::CONE >
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::CYLINDER >
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::SPHERE >
Function shapes::computeShapeBoundingSphere
Function shapes::computeShapeExtents(const ShapeMsg&)
Function shapes::computeShapeExtents(const Shape *)
Function shapes::constructMarkerFromShape
Function shapes::constructMsgFromShape
Function shapes::constructShapeFromMsg(const shape_msgs::msg::SolidPrimitive&)
Function shapes::constructShapeFromMsg(const shape_msgs::msg::Plane&)
Function shapes::constructShapeFromMsg(const shape_msgs::msg::Mesh&)
Function shapes::constructShapeFromMsg(const ShapeMsg&)
Function shapes::constructShapeFromText
Function shapes::createMeshFromAsset(const aiScene *, const Eigen::Vector3d&, const std::string&)
Function shapes::createMeshFromAsset(const aiScene *, const std::string&)
Function shapes::createMeshFromBinary(const char *, std::size_t, const std::string&)
Function shapes::createMeshFromBinary(const char *, std::size_t, const Eigen::Vector3d&, const std::string&)
Function shapes::createMeshFromResource(const std::string&)
Function shapes::createMeshFromResource(const std::string&, const Eigen::Vector3d&)
Function shapes::createMeshFromShape(const Shape *)
Function shapes::createMeshFromShape(const Box&)
Function shapes::createMeshFromShape(const Sphere&)
Function shapes::createMeshFromShape(const Cylinder&)
Function shapes::createMeshFromShape(const Cone&)
Function shapes::createMeshFromVertices(const EigenSTL::vector_Vector3d&, const std::vector<unsigned int>&)
Function shapes::createMeshFromVertices(const EigenSTL::vector_Vector3d&)
Function shapes::operator<<
Function shapes::saveAsText
Function shapes::shapeStringName
Function shapes::writeSTLBinary
Defines
Define _USE_MATH_DEFINES
Define ASSERT_ISOMETRY
Define CHECK_ISOMETRY_PRECISION
Typedefs
Typedef bodies::BodyConstPtr
Typedef bodies::BodyPtr
Typedef shapes::ShapeConstPtr
Typedef shapes::ShapeMsg
Typedef shapes::ShapePtr
Directories
Directory include
Directory geometric_shapes
Files
File aabb.h
File bodies.h
File body_operations.h
File check_isometry.h
File mesh_operations.h
File obb.h
File shape_extents.h
File shape_messages.h
File shape_operations.h
File shape_to_marker.h
File shapes.h
File solid_primitive_dims.h
Standard Documents
CHANGELOG
Changelog for package geometric_shapes
2.3.2 (2025-01-23)
2.3.1 (2024-12-06)
2.3.0 (2024-11-29)
2.2.1 (2024-06-26)
2.2.0 (2024-06-07)
2.1.3 (2022-03-08)
2.1.2 (2021-12-22)
2.1.1 (2021-09-27)
2.1.0 (2021-06-15)
2.0.2 (2021-05-22)
2.0.1 (2021-04-09)
2.0.0 (2020-11-20)
0.7.2 (2020-09-25)
0.7.1 (2020-08-31)
0.7.0 (2020-05-25)
0.6.3 (2020-05-25)
0.6.2 (2020-05-02)
0.6.1 (2018-12-09)
0.6.0 (2018-05-14)
0.5.4 (2018-04-06)
0.5.3 (2017-11-26)
0.5.2 (2016-10-20)
0.5.1 (2016-08-23)
0.5.0 (2016-07-31)
0.4.4 (2016-03-06)
0.4.3 (2015-04-30)
0.4.2 (2015-04-22)
0.4.1 (2014-07-07)
0.4.0 (2014-06-24)
0.3.8 (2014-02-25)
0.3.7 (2014-02-23)
0.3.6 (2014-01-31)
0.3.5 (2013-09-23)
CONTRIBUTING
LICENSE
PACKAGE
README
Geometric Shapes
Build Status
Index
geometric_shapes
C++ API
View page source
C++ API
Class Hierarchy
Namespace
bodies
Struct
BoundingCylinder
Struct
BoundingSphere
Class
AABB
Class
Body
Class
BodyVector
Class
Box
Class
ConvexMesh
Class
Cylinder
Class
OBB
Class
Sphere
Namespace
shapes
Class
Box
Class
Cone
Class
Cylinder
Class
Mesh
Class
OcTree
Class
Plane
Class
Shape
Class
Sphere
Enum
ShapeType
File Hierarchy
Directory
include
Directory
geometric_shapes
File
aabb.h
File
bodies.h
File
body_operations.h
File
check_isometry.h
File
mesh_operations.h
File
obb.h
File
shape_extents.h
File
shape_messages.h
File
shape_operations.h
File
shape_to_marker.h
File
shapes.h
File
solid_primitive_dims.h
Full C++ API
Namespaces
Namespace bodies
Namespace Eigen
Namespace geometric_shapes
Namespace octomap
Namespace shapes
Classes and Structs
Struct BoundingCylinder
Struct BoundingSphere
Class AABB
Class Body
Class BodyVector
Class Box
Class ConvexMesh
Class Cylinder
Class OBB
Class Sphere
Class Box
Class Cone
Class Cylinder
Class Mesh
Class OcTree
Class Plane
Class Shape
Class Sphere
Enums
Enum ShapeType
Functions
Function bodies::computeBoundingSphere
Function bodies::constructBodyFromMsg(const shape_msgs::msg::Mesh&, const geometry_msgs::msg::Pose&)
Function bodies::constructBodyFromMsg(const shape_msgs::msg::SolidPrimitive&, const geometry_msgs::msg::Pose&)
Function bodies::constructBodyFromMsg(const shapes::ShapeMsg&, const geometry_msgs::msg::Pose&)
Function bodies::constructMarkerFromBody
Function bodies::constructShapeFromBody
Function bodies::createBodyFromShape
Function bodies::createEmptyBodyFromShapeType
Function bodies::mergeBoundingBoxes
Function bodies::mergeBoundingBoxesApprox
Function bodies::mergeBoundingSpheres
Function checkIsometry
Function geometric_shapes::constructMarkerFromShape(const shape_msgs::msg::Mesh&, visualization_msgs::msg::Marker&, bool)
Function geometric_shapes::constructMarkerFromShape(const shape_msgs::msg::SolidPrimitive&, visualization_msgs::msg::Marker&)
Function geometric_shapes::getShapeExtents(const shape_msgs::msg::SolidPrimitive&, double&, double&, double&)
Function geometric_shapes::getShapeExtents(const shape_msgs::msg::Mesh&, double&, double&, double&)
Template Function geometric_shapes::solidPrimitiveDimCount
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::BOX >
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::CONE >
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::CYLINDER >
Specialized Template Function geometric_shapes::solidPrimitiveDimCount< shape_msgs::msg::SolidPrimitive::SPHERE >
Function shapes::computeShapeBoundingSphere
Function shapes::computeShapeExtents(const ShapeMsg&)
Function shapes::computeShapeExtents(const Shape *)
Function shapes::constructMarkerFromShape
Function shapes::constructMsgFromShape
Function shapes::constructShapeFromMsg(const shape_msgs::msg::SolidPrimitive&)
Function shapes::constructShapeFromMsg(const shape_msgs::msg::Plane&)
Function shapes::constructShapeFromMsg(const shape_msgs::msg::Mesh&)
Function shapes::constructShapeFromMsg(const ShapeMsg&)
Function shapes::constructShapeFromText
Function shapes::createMeshFromAsset(const aiScene *, const Eigen::Vector3d&, const std::string&)
Function shapes::createMeshFromAsset(const aiScene *, const std::string&)
Function shapes::createMeshFromBinary(const char *, std::size_t, const std::string&)
Function shapes::createMeshFromBinary(const char *, std::size_t, const Eigen::Vector3d&, const std::string&)
Function shapes::createMeshFromResource(const std::string&)
Function shapes::createMeshFromResource(const std::string&, const Eigen::Vector3d&)
Function shapes::createMeshFromShape(const Shape *)
Function shapes::createMeshFromShape(const Box&)
Function shapes::createMeshFromShape(const Sphere&)
Function shapes::createMeshFromShape(const Cylinder&)
Function shapes::createMeshFromShape(const Cone&)
Function shapes::createMeshFromVertices(const EigenSTL::vector_Vector3d&, const std::vector<unsigned int>&)
Function shapes::createMeshFromVertices(const EigenSTL::vector_Vector3d&)
Function shapes::operator<<
Function shapes::saveAsText
Function shapes::shapeStringName
Function shapes::writeSTLBinary
Defines
Define _USE_MATH_DEFINES
Define ASSERT_ISOMETRY
Define CHECK_ISOMETRY_PRECISION
Typedefs
Typedef bodies::BodyConstPtr
Typedef bodies::BodyPtr
Typedef shapes::ShapeConstPtr
Typedef shapes::ShapeMsg
Typedef shapes::ShapePtr
Directories
Directory include
Directory geometric_shapes
Files
File aabb.h
File bodies.h
File body_operations.h
File check_isometry.h
File mesh_operations.h
File obb.h
File shape_extents.h
File shape_messages.h
File shape_operations.h
File shape_to_marker.h
File shapes.h
File solid_primitive_dims.h