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_publisher.hpp"
27#include "realtime_tools/realtime_thread_safe_box.hpp"
28
29// TODO(anyone): Replace with controller specific messages
30#include "control_msgs/msg/steering_controller_status.hpp"
31#include "geometry_msgs/msg/twist_stamped.hpp"
32#include "nav_msgs/msg/odometry.hpp"
33#include "tf2_msgs/msg/tf_message.hpp"
34
35#include "steering_controllers_library/steering_controllers_library_parameters.hpp"
36#include "steering_controllers_library/steering_odometry.hpp"
37
38namespace steering_controllers_library
39{
41{
42public:
44
45 virtual void initialize_implementation_parameter_listener() = 0;
46
47 controller_interface::CallbackReturn on_init() override;
48
50
52
53 virtual controller_interface::CallbackReturn configure_odometry() = 0;
54
55 virtual bool update_odometry(const rclcpp::Duration & period) = 0;
56
57 controller_interface::CallbackReturn on_configure(
58 const rclcpp_lifecycle::State & previous_state) override;
59
60 controller_interface::CallbackReturn on_activate(
61 const rclcpp_lifecycle::State & previous_state) override;
62
63 controller_interface::CallbackReturn on_deactivate(
64 const rclcpp_lifecycle::State & previous_state) override;
65
66 controller_interface::return_type update_reference_from_subscribers(
67 const rclcpp::Time & time, const rclcpp::Duration & period) override;
68
69 controller_interface::return_type update_and_write_commands(
70 const rclcpp::Time & time, const rclcpp::Duration & period) override;
71
72 using ControllerTwistReferenceMsg = geometry_msgs::msg::TwistStamped;
73 using ControllerStateMsgOdom = nav_msgs::msg::Odometry;
74 using ControllerStateMsgTf = tf2_msgs::msg::TFMessage;
75 using SteeringControllerStateMsg = control_msgs::msg::SteeringControllerStatus;
76
77protected:
78 controller_interface::CallbackReturn set_interface_numbers(
79 size_t nr_state_itfs, size_t nr_cmd_itfs, size_t nr_ref_itfs);
80
81 std::shared_ptr<steering_controllers_library::ParamListener> param_listener_;
82 steering_controllers_library::Params params_;
83
84 // the RT Box containing the command message
86 // save the last reference in case of unable to get value from box
87 ControllerTwistReferenceMsg current_ref_;
88 rclcpp::Duration ref_timeout_ = rclcpp::Duration::from_seconds(0.0); // 0ms
89
90 // Command subscribers and Controller State publisher
91 rclcpp::Subscription<ControllerTwistReferenceMsg>::SharedPtr ref_subscriber_twist_ = nullptr;
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 ControllerStateMsgOdom odom_state_msg_;
100 std::unique_ptr<ControllerStatePublisherTf> rt_tf_odom_state_publisher_;
101 ControllerStateMsgTf tf_odom_state_msg_;
102
103 // override methods from ChainableControllerInterface
104 std::vector<hardware_interface::CommandInterface> on_export_reference_interfaces() override;
105
106 bool on_set_chained_mode(bool chained_mode) override;
107
110
111 SteeringControllerStateMsg published_state_;
112
114 rclcpp::Publisher<SteeringControllerStateMsg>::SharedPtr controller_s_publisher_;
115 std::unique_ptr<ControllerStatePublisher> controller_state_publisher_;
116 SteeringControllerStateMsg controller_state_msg_;
117
118 // name constants for state interfaces
119 size_t nr_state_itfs_;
120 // name constants for command interfaces
121 size_t nr_cmd_itfs_;
122 // name constants for reference interfaces
123 size_t nr_ref_itfs_;
124
125 // last velocity commands for open loop odometry
126 double last_linear_velocity_ = 0.0;
127 double last_angular_velocity_ = 0.0;
128
129 std::vector<std::string> traction_joints_state_names_;
130 std::vector<std::string> steering_joints_state_names_;
131
132private:
133 // callback for topic interface
134 void reference_callback(const std::shared_ptr<ControllerTwistReferenceMsg> msg);
135};
136
137} // namespace steering_controllers_library
138
139#endif // STEERING_CONTROLLERS_LIBRARY__STEERING_CONTROLLERS_LIBRARY_HPP_
Definition chainable_controller_interface.hpp:37
Definition realtime_publisher.hpp:55
Definition realtime_thread_safe_box.hpp:68
Definition steering_controllers_library.hpp:41
controller_interface::InterfaceConfiguration command_interface_configuration() const override
Get configuration for controller's required command interfaces.
Definition steering_controllers_library.cpp:366
std::vector< hardware_interface::CommandInterface > on_export_reference_interfaces() override
Definition steering_controllers_library.cpp:412
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:432
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:507
controller_interface::CallbackReturn on_init() override
Extending interface with initialization method which is individual for each controller.
Definition steering_controllers_library.cpp:54
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:462
steering_odometry::SteeringOdometry odometry_
Odometry:
Definition steering_controllers_library.hpp:109
controller_interface::InterfaceConfiguration state_interface_configuration() const override
Get configuration for controller's required state interfaces.
Definition steering_controllers_library.cpp:386
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:60