ros2_control - rolling
Loading...
Searching...
No Matches
steering_controllers_library.hpp
1// Copyright (c) 2023, Stogl Robotics Consulting UG (haftungsbeschränkt)
2//
3// Licensed under the Apache License, Version 2.0 (the "License");
4// you may not use this file except in compliance with the License.
5// You may obtain a copy of the License at
6//
7// http://www.apache.org/licenses/LICENSE-2.0
8//
9// Unless required by applicable law or agreed to in writing, software
10// distributed under the License is distributed on an "AS IS" BASIS,
11// WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
12// See the License for the specific language governing permissions and
13// limitations under the License.
14
15#ifndef STEERING_CONTROLLERS_LIBRARY__STEERING_CONTROLLERS_LIBRARY_HPP_
16#define STEERING_CONTROLLERS_LIBRARY__STEERING_CONTROLLERS_LIBRARY_HPP_
17
18#include <cmath>
19#include <memory>
20#include <string>
21#include <vector>
22
23#include "controller_interface/chainable_controller_interface.hpp"
24#include "hardware_interface/handle.hpp"
25#include "rclcpp_lifecycle/state.hpp"
26#include "realtime_tools/realtime_buffer.hpp"
27#include "realtime_tools/realtime_publisher.hpp"
28
29// TODO(anyone): Replace with controller specific messages
30#include "ackermann_msgs/msg/ackermann_drive_stamped.hpp"
31#include "control_msgs/msg/steering_controller_status.hpp"
32#include "geometry_msgs/msg/twist_stamped.hpp"
33#include "nav_msgs/msg/odometry.hpp"
34#include "tf2_msgs/msg/tf_message.hpp"
35
36#include "steering_controllers_library/steering_controllers_library_parameters.hpp"
37#include "steering_controllers_library/steering_odometry.hpp"
38
39namespace steering_controllers_library
40{
42{
43public:
45
46 virtual void initialize_implementation_parameter_listener() = 0;
47
48 controller_interface::CallbackReturn on_init() override;
49
51
53
54 virtual controller_interface::CallbackReturn configure_odometry() = 0;
55
56 virtual bool update_odometry(const rclcpp::Duration & period) = 0;
57
58 controller_interface::CallbackReturn on_configure(
59 const rclcpp_lifecycle::State & previous_state) override;
60
61 controller_interface::CallbackReturn on_activate(
62 const rclcpp_lifecycle::State & previous_state) override;
63
64 controller_interface::CallbackReturn on_deactivate(
65 const rclcpp_lifecycle::State & previous_state) override;
66
67 controller_interface::return_type update_reference_from_subscribers(
68 const rclcpp::Time & time, const rclcpp::Duration & period) override;
69
70 controller_interface::return_type update_and_write_commands(
71 const rclcpp::Time & time, const rclcpp::Duration & period) override;
72
73 using ControllerAckermannReferenceMsg = ackermann_msgs::msg::AckermannDriveStamped;
74 using ControllerTwistReferenceMsg = geometry_msgs::msg::TwistStamped;
75 using ControllerStateMsgOdom = nav_msgs::msg::Odometry;
76 using ControllerStateMsgTf = tf2_msgs::msg::TFMessage;
77 using AckermannControllerState = control_msgs::msg::SteeringControllerStatus;
78
79protected:
80 controller_interface::CallbackReturn set_interface_numbers(
81 size_t nr_state_itfs, size_t nr_cmd_itfs, size_t nr_ref_itfs);
82
83 std::shared_ptr<steering_controllers_library::ParamListener> param_listener_;
84 steering_controllers_library::Params params_;
85
86 // Command subscribers and Controller State publisher
87 rclcpp::Subscription<ControllerTwistReferenceMsg>::SharedPtr ref_subscriber_twist_ = nullptr;
88 rclcpp::Subscription<ControllerTwistReferenceMsg>::SharedPtr ref_subscriber_ackermann_ = nullptr;
90 rclcpp::Duration ref_timeout_ = rclcpp::Duration::from_seconds(0.0); // 0ms
91
94
95 rclcpp::Publisher<ControllerStateMsgOdom>::SharedPtr odom_s_publisher_;
96 rclcpp::Publisher<ControllerStateMsgTf>::SharedPtr tf_odom_s_publisher_;
97
98 std::unique_ptr<ControllerStatePublisherOdom> rt_odom_state_publisher_;
99 std::unique_ptr<ControllerStatePublisherTf> rt_tf_odom_state_publisher_;
100
101 // override methods from ChainableControllerInterface
102 std::vector<hardware_interface::CommandInterface> on_export_reference_interfaces() override;
103
104 bool on_set_chained_mode(bool chained_mode) override;
105
108
109 AckermannControllerState published_state_;
110
112 rclcpp::Publisher<AckermannControllerState>::SharedPtr controller_s_publisher_;
113 std::unique_ptr<ControllerStatePublisher> controller_state_publisher_;
114
115 // name constants for state interfaces
116 size_t nr_state_itfs_;
117 // name constants for command interfaces
118 size_t nr_cmd_itfs_;
119 // name constants for reference interfaces
120 size_t nr_ref_itfs_;
121
122 // last velocity commands for open loop odometry
123 double last_linear_velocity_ = 0.0;
124 double last_angular_velocity_ = 0.0;
125
126 std::vector<std::string> rear_wheels_state_names_;
127 std::vector<std::string> front_wheels_state_names_;
128
129private:
130 // callback for topic interface
131 void reference_callback(const std::shared_ptr<ControllerTwistReferenceMsg> msg);
132};
133
134} // namespace steering_controllers_library
135
136#endif // STEERING_CONTROLLERS_LIBRARY__STEERING_CONTROLLERS_LIBRARY_HPP_
Definition chainable_controller_interface.hpp:37
Definition realtime_buffer.hpp:44
Definition realtime_publisher.hpp:54
Definition steering_controllers_library.hpp:42
controller_interface::InterfaceConfiguration command_interface_configuration() const override
Get configuration for controller's required command interfaces.
Definition steering_controllers_library.cpp:232
std::vector< hardware_interface::CommandInterface > on_export_reference_interfaces() override
Definition steering_controllers_library.cpp:312
bool on_set_chained_mode(bool chained_mode) override
Virtual method that each chainable controller should implement to switch chained mode.
Definition steering_controllers_library.cpp:330
controller_interface::return_type update_and_write_commands(const rclcpp::Time &time, const rclcpp::Duration &period) override
Execute calculations of the controller and update command interfaces.
Definition steering_controllers_library.cpp:369
controller_interface::CallbackReturn on_init() override
Extending interface with initialization method which is individual for each controller.
Definition steering_controllers_library.cpp:55
controller_interface::return_type update_reference_from_subscribers(const rclcpp::Time &time, const rclcpp::Duration &period) override
Update reference from input topics when not in chained mode.
Definition steering_controllers_library.cpp:355
steering_odometry::SteeringOdometry odometry_
Odometry:
Definition steering_controllers_library.hpp:107
controller_interface::InterfaceConfiguration state_interface_configuration() const override
Get configuration for controller's required state interfaces.
Definition steering_controllers_library.cpp:270
The Odometry class handles odometry readings (2D pose and velocity with related timestamp)
Definition steering_odometry.hpp:47
Configuring what command/state interfaces to claim.
Definition controller_interface_base.hpp:57