Carma-platform v4.2.0
CARMA Platform is built on robot operating system (ROS) and utilizes open source software (OSS) that enables Cooperative Driving Automation (CDA) features to allow Automated Driving Systems to interact and cooperate with infrastructure and other vehicles through communication.
arbitrator.hpp
Go to the documentation of this file.
1/*
2 * Copyright (C) 2022 LEIDOS.
3 *
4 * Licensed under the Apache License, Version 2.0 (the "License"); you may not
5 * use this file except in compliance with the License. You may obtain a copy of
6 * the License at
7 *
8 * http://www.apache.org/licenses/LICENSE-2.0
9 *
10 * Unless required by applicable law or agreed to in writing, software
11 * distributed under the License is distributed on an "AS IS" BASIS, WITHOUT
12 * WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. See the
13 * License for the specific language governing permissions and limitations under
14 * the License.
15 */
16
17#ifndef __ARBITRATOR_INCLUDE_ARBITRATOR_HPP__
18#define __ARBITRATOR_INCLUDE_ARBITRATOR_HPP__
19
20#include <rclcpp/rclcpp.hpp>
21#include <carma_ros2_utils/carma_lifecycle_node.hpp>
22#include <carma_planning_msgs/msg/guidance_state.hpp>
24#include <geometry_msgs/msg/pose_stamped.hpp>
25#include <geometry_msgs/msg/twist_stamped.hpp>
26#include <tf2_ros/transform_listener.h>
27#include <tf2_ros/buffer.h>
28#include <tf2/LinearMath/Transform.h>
29#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
30
31#include "vehicle_state.hpp"
33#include "planning_strategy.hpp"
35
36namespace arbitrator
37{
46 {
47 public:
58 Arbitrator(std::shared_ptr<carma_ros2_utils::CarmaLifecycleNode> nh,
59 std::shared_ptr<ArbitratorStateMachine> sm,
60 std::shared_ptr<CapabilitiesInterface> ci,
61 std::shared_ptr<PlanningStrategy> planning_strategy,
62 rclcpp::Duration min_plan_duration,
63 double planning_period,
65 sm_(sm),
66 nh_(nh),
67 min_plan_duration_(min_plan_duration),
68 time_between_plans_(rclcpp::Duration::from_seconds(planning_period)),
70 planning_strategy_(planning_strategy),
71 initialized_(false),
72 wm_(wm),
73 tf2_buffer_(nh_->get_clock()) {};
74
80 void run();
81
86 void twist_cb(geometry_msgs::msg::TwistStamped::UniquePtr msg);
87
91 void bumper_pose_cb();
92
97
98 protected:
102 void initial_state();
103
107 void planning_state();
108
113 void waiting_state();
114
119 void paused_state();
120
124 void shutdown_state();
125
130 void guidance_state_cb(carma_planning_msgs::msg::GuidanceState::UniquePtr msg);
131
132 private:
133
134 VehicleState vehicle_state_; // The current state of the vehicle for populating planning requests
135
136 std::shared_ptr<ArbitratorStateMachine> sm_;
137 carma_ros2_utils::PubPtr<carma_planning_msgs::msg::ManeuverPlan> final_plan_pub_;
138 carma_ros2_utils::SubPtr<carma_planning_msgs::msg::GuidanceState> guidance_state_sub_;
139 std::shared_ptr<carma_ros2_utils::CarmaLifecycleNode> nh_;
140 rclcpp::Duration min_plan_duration_;
141 rclcpp::Duration time_between_plans_;
143 std::shared_ptr<CapabilitiesInterface> capabilities_interface_;
144 std::shared_ptr<PlanningStrategy> planning_strategy_;
147
148 geometry_msgs::msg::TransformStamped tf_;
149 // TF listenser
150 tf2_ros::Buffer tf2_buffer_;
151 std::unique_ptr<tf2_ros::TransformListener> tf2_listener_;
152 // transform from front bumper to map
153 tf2::Stamped<tf2::Transform> bumper_transform_;
155 };
156}
157
158#endif
void planning_state()
Function to be called when the Arbitrator begins planning.
Definition: arbitrator.cpp:120
tf2::Stamped< tf2::Transform > bumper_transform_
Definition: arbitrator.hpp:153
rclcpp::Time next_planning_process_start_
Definition: arbitrator.hpp:142
void shutdown_state()
Function to be executed when the Arbitrator is to clean up and shutdown.
Definition: arbitrator.cpp:164
void paused_state()
Function to be executed when the Arbitrator is not planning but also not awaiting a new plan cycle.
Definition: arbitrator.cpp:159
Arbitrator(std::shared_ptr< carma_ros2_utils::CarmaLifecycleNode > nh, std::shared_ptr< ArbitratorStateMachine > sm, std::shared_ptr< CapabilitiesInterface > ci, std::shared_ptr< PlanningStrategy > planning_strategy, rclcpp::Duration min_plan_duration, double planning_period, carma_wm::WorldModelConstPtr wm)
Constructor for arbitrator class taking in dependencies via dependency injection.
Definition: arbitrator.hpp:58
void initial_state()
Function to be executed during the initial state of the Arbitrator.
Definition: arbitrator.cpp:105
rclcpp::Duration min_plan_duration_
Definition: arbitrator.hpp:140
carma_ros2_utils::PubPtr< carma_planning_msgs::msg::ManeuverPlan > final_plan_pub_
Definition: arbitrator.hpp:137
std::shared_ptr< carma_ros2_utils::CarmaLifecycleNode > nh_
Definition: arbitrator.hpp:139
void twist_cb(geometry_msgs::msg::TwistStamped::UniquePtr msg)
Callback for the twist subscriber, which will store latest twist locally.
Definition: arbitrator.cpp:206
tf2_ros::Buffer tf2_buffer_
Definition: arbitrator.hpp:150
carma_ros2_utils::SubPtr< carma_planning_msgs::msg::GuidanceState > guidance_state_sub_
Definition: arbitrator.hpp:138
void waiting_state()
Function to be executed when the Arbitrator has finished planning and is awaiting another planning cy...
Definition: arbitrator.cpp:153
carma_wm::WorldModelConstPtr wm_
Definition: arbitrator.hpp:146
rclcpp::Duration time_between_plans_
Definition: arbitrator.hpp:141
std::shared_ptr< PlanningStrategy > planning_strategy_
Definition: arbitrator.hpp:144
void initializeBumperTransformLookup()
Initialize transform Lookup from front bumper to map.
Definition: arbitrator.cpp:211
std::unique_ptr< tf2_ros::TransformListener > tf2_listener_
Definition: arbitrator.hpp:151
void run()
Begin the operation of the arbitrator.
Definition: arbitrator.cpp:27
std::shared_ptr< CapabilitiesInterface > capabilities_interface_
Definition: arbitrator.hpp:143
VehicleState vehicle_state_
Definition: arbitrator.hpp:134
geometry_msgs::msg::TransformStamped tf_
Definition: arbitrator.hpp:148
void bumper_pose_cb()
Callback for the front bumper pose transform.
Definition: arbitrator.cpp:170
void guidance_state_cb(carma_planning_msgs::msg::GuidanceState::UniquePtr msg)
Callback for receiving Guidance state machine updates.
Definition: arbitrator.cpp:67
std::shared_ptr< ArbitratorStateMachine > sm_
Definition: arbitrator.hpp:136
std::shared_ptr< const WorldModel > WorldModelConstPtr
Definition: WorldModel.hpp:454
Struct defining the vehicle state required for maneuver planning.