Autoware.Auto
off_map_obstacles_filter.cpp File Reference
#include "off_map_obstacles_filter/off_map_obstacles_filter.hpp"
#include <cmath>
#include <memory>
#include <vector>
#include "common/types.hpp"
#include "geometry_msgs/msg/transform_stamped.hpp"
#include "Eigen/Geometry"
#include "lanelet2_core/geometry/Lanelet.h"
#include "lanelet2_core/geometry/Point.h"
#include "lanelet2_core/geometry/Polygon.h"
#include "lanelet2_core/LaneletMap.h"
#include "boost/geometry/geometries/geometries.hpp"
#include "boost/geometry.hpp"
Include dependency graph for off_map_obstacles_filter.cpp:

Namespaces

 autoware
 This file defines the lanelet2_map_provider_node class.
 
 autoware::off_map_obstacles_filter
 A namespace for the temporary off-map obstacles filter.
 

Typedefs

using autoware::off_map_obstacles_filter::float32_t = autoware::common::types::float32_t
 

Functions

static lanelet::Polygon2d autoware::off_map_obstacles_filter::polygon_for_bbox (const Eigen::Isometry2f &map_from_base_link, const autoware_auto_perception_msgs::msg::BoundingBox &bbox)
 
static Eigen::Isometry2d autoware::off_map_obstacles_filter::convert_2d_transform (const geometry_msgs::msg::TransformStamped &tfs)
 Convert TransformStamped to Isometry2f – this assumes that the direction of the z axis is the same in the two frames. More...
 
static bool autoware::off_map_obstacles_filter::bbox_is_on_map (const lanelet::LaneletMap &map, const Eigen::Isometry2f &map_from_base_link, const float64_t overlap_threshold, const autoware_auto_perception_msgs::msg::BoundingBox &bbox)
 Checks if a bbox is on the map. More...