Autoware.Auto
global_velocity_planner_node.hpp File Reference

This file defines the global_velocity_planner_node class. More...

#include <common/types.hpp>
#include <rclcpp/rclcpp.hpp>
#include <autoware_auto_mapping_msgs/srv/had_map_service.hpp>
#include <autoware_auto_planning_msgs/msg/trajectory.hpp>
#include <autoware_auto_planning_msgs/msg/trajectory_point.hpp>
#include <autoware_auto_planning_msgs/srv/modify_trajectory.hpp>
#include <lanelet2_core/LaneletMap.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <global_velocity_planner/global_velocity_planner.hpp>
#include <memory>
Include dependency graph for global_velocity_planner_node.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  autoware::global_velocity_planner::GlobalVelocityPlannerNode
 Global velocity planner, it is created to test the controllers. More...
 

Namespaces

 autoware
 This file defines the lanelet2_map_provider_node class.
 
 autoware::global_velocity_planner
 TODO(berkay): Document namespaces!
 

Typedefs

using autoware::global_velocity_planner::HADMapService = autoware_auto_mapping_msgs::srv::HADMapService
 

Detailed Description

This file defines the global_velocity_planner_node class.