Autoware.Auto
off_map_obstacles_filter_node.hpp File Reference

This file defines the off_map_obstacles_filter_nodes_node class. More...

#include <memory>
#include <string>
#include "autoware_auto_perception_msgs/msg/bounding_box_array.hpp"
#include "autoware_auto_mapping_msgs/srv/had_map_service.hpp"
#include "off_map_obstacles_filter_nodes/visibility_control.hpp"
#include "off_map_obstacles_filter/off_map_obstacles_filter.hpp"
#include "common/types.hpp"
#include "lanelet2_core/LaneletMap.h"
#include "rclcpp/rclcpp.hpp"
#include "tf2_ros/buffer.h"
#include "tf2_ros/transform_listener.h"
#include "visualization_msgs/msg/marker_array.hpp"
Include dependency graph for off_map_obstacles_filter_node.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  autoware::off_map_obstacles_filter_nodes::OffMapObstaclesFilterNode
 ROS 2 Node that removes obstacles that are off the map. See the design doc for more. More...
 

Namespaces

 autoware
 This file defines the lanelet2_map_provider_node class.
 
 autoware::off_map_obstacles_filter_nodes
 

Typedefs

using autoware::off_map_obstacles_filter_nodes::float64_t = autoware::common::types::float64_t
 
using autoware::off_map_obstacles_filter_nodes::OffMapObstaclesFilter = autoware::off_map_obstacles_filter::OffMapObstaclesFilter
 

Detailed Description

This file defines the off_map_obstacles_filter_nodes_node class.