Autoware.Auto
bounding_box.cpp File Reference
#include <autoware_auto_tf2/tf2_autoware_auto_msgs.hpp>
#include <geometry/bounding_box/bounding_box_common.hpp>
#include <geometry/bounding_box/rotating_calipers.hpp>
#include <geometry/bounding_box/eigenbox_2d.hpp>
#include <geometry/bounding_box/lfit.hpp>
#include <geometry_msgs/msg/point32.hpp>
#include <algorithm>
#include <limits>
#include <list>
#include <utility>
#include <vector>
Include dependency graph for bounding_box.cpp:

Namespaces

 autoware
 This file defines the lanelet2_map_provider_node class.
 
 autoware::common
 
 autoware::common::geometry
 
 autoware::common::geometry::bounding_box
 Functions and types for generating enclosing bounding boxes around a set of points.
 
 autoware::common::geometry::bounding_box::details
 

Typedefs

using autoware::common::geometry::bounding_box::PointXYZIFVIT = std::vector< PointXYZIF >::iterator
 
using autoware::common::geometry::bounding_box::Point32VIT = std::vector< Point32 >::iterator
 

Functions

void GEOMETRY_PUBLIC autoware::common::geometry::bounding_box::details::size_2d (const decltype(BoundingBox::corners) &corners, geometry_msgs::msg::Point32 &ret)
 Compute length, width, area of bounding box. More...
 
void GEOMETRY_PUBLIC autoware::common::geometry::bounding_box::details::finalize_box (const decltype(BoundingBox::corners) &corners, BoundingBox &box)
 Computes centroid and orientation of a box given corners. More...
 
autoware_auto_perception_msgs::msg::Shape GEOMETRY_PUBLIC autoware::common::geometry::bounding_box::details::make_shape (const BoundingBox &box)
 Copy vertices of the given box into a Shape type. More...
 
autoware_auto_perception_msgs::msg::DetectedObject GEOMETRY_PUBLIC autoware::common::geometry::bounding_box::details::make_detected_object (const BoundingBox &box)
 Fill DetectedObject type with contents from a BoundingBox type. More...
 
std::vector< geometry_msgs::msg::Point32 > GEOMETRY_PUBLIC autoware::common::geometry::bounding_box::details::get_transformed_corners (const autoware_auto_perception_msgs::msg::Shape &shape_msg, const geometry_msgs::msg::Point &centroid, const geometry_msgs::msg::Quaternion &orientation)
 Transform corners from object-local coordinates using the given centroid and orientation. More...
 
template BoundingBox autoware::common::geometry::bounding_box::minimum_area_bounding_box< PointXYZIF > (std::list< PointXYZIF > &list)
 
template BoundingBox autoware::common::geometry::bounding_box::minimum_perimeter_bounding_box< PointXYZIF > (std::list< PointXYZIF > &list)
 
template BoundingBox autoware::common::geometry::bounding_box::eigenbox_2d< PointXYZIFVIT > (const PointXYZIFVIT begin, const PointXYZIFVIT end)
 
template BoundingBox autoware::common::geometry::bounding_box::lfit_bounding_box_2d< PointXYZIFVIT > (const PointXYZIFVIT begin, const PointXYZIFVIT end)
 
template BoundingBox autoware::common::geometry::bounding_box::minimum_area_bounding_box< Point32 > (std::list< Point32 > &list)
 
template BoundingBox autoware::common::geometry::bounding_box::minimum_perimeter_bounding_box< Point32 > (std::list< Point32 > &list)
 
template BoundingBox autoware::common::geometry::bounding_box::eigenbox_2d< Point32VIT > (const Point32VIT begin, const Point32VIT end)
 
template BoundingBox autoware::common::geometry::bounding_box::lfit_bounding_box_2d< Point32VIT > (const Point32VIT begin, const Point32VIT end)