ros2_control - rolling
Loading...
Searching...
No Matches
diff_drive_controller.hpp
1// Copyright 2020 PAL Robotics S.L.
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/*
16 * Author: Bence Magyar, Enrique Fernández, Manuel Meraz
17 */
18
19#ifndef DIFF_DRIVE_CONTROLLER__DIFF_DRIVE_CONTROLLER_HPP_
20#define DIFF_DRIVE_CONTROLLER__DIFF_DRIVE_CONTROLLER_HPP_
21
22#include <chrono>
23#include <memory>
24#include <queue>
25#include <string>
26#include <vector>
27
28#include "controller_interface/chainable_controller_interface.hpp"
29#include "diff_drive_controller/odometry.hpp"
30#include "diff_drive_controller/speed_limiter.hpp"
31#include "geometry_msgs/msg/twist_stamped.hpp"
32#include "nav_msgs/msg/odometry.hpp"
33#include "odometry.hpp"
34#include "rclcpp_lifecycle/state.hpp"
35#include "realtime_tools/realtime_buffer.hpp"
36#include "realtime_tools/realtime_publisher.hpp"
37#include "tf2_msgs/msg/tf_message.hpp"
38
39// auto-generated by generate_parameter_library
40#include "diff_drive_controller/diff_drive_controller_parameters.hpp"
41
42namespace diff_drive_controller
43{
45{
46 using TwistStamped = geometry_msgs::msg::TwistStamped;
47
48public:
50
52
54
55 // Chainable controller replaces update() with the following two functions
56 controller_interface::return_type update_reference_from_subscribers(
57 const rclcpp::Time & time, const rclcpp::Duration & period) override;
58
59 controller_interface::return_type update_and_write_commands(
60 const rclcpp::Time & time, const rclcpp::Duration & period) override;
61
62 controller_interface::CallbackReturn on_init() override;
63
64 controller_interface::CallbackReturn on_configure(
65 const rclcpp_lifecycle::State & previous_state) override;
66
67 controller_interface::CallbackReturn on_activate(
68 const rclcpp_lifecycle::State & previous_state) override;
69
70 controller_interface::CallbackReturn on_deactivate(
71 const rclcpp_lifecycle::State & previous_state) override;
72
73 controller_interface::CallbackReturn on_cleanup(
74 const rclcpp_lifecycle::State & previous_state) override;
75
76 controller_interface::CallbackReturn on_error(
77 const rclcpp_lifecycle::State & previous_state) override;
78
79protected:
80 bool on_set_chained_mode(bool chained_mode) override;
81
82 std::vector<hardware_interface::CommandInterface> on_export_reference_interfaces() override;
83
85 {
86 std::reference_wrapper<const hardware_interface::LoanedStateInterface> feedback;
87 std::reference_wrapper<hardware_interface::LoanedCommandInterface> velocity;
88 };
89
90 const char * feedback_type() const;
91 controller_interface::CallbackReturn configure_side(
92 const std::string & side, const std::vector<std::string> & wheel_names,
93 std::vector<WheelHandle> & registered_handles);
94
95 std::vector<WheelHandle> registered_left_wheel_handles_;
96 std::vector<WheelHandle> registered_right_wheel_handles_;
97
98 // Parameters from ROS for diff_drive_controller
99 std::shared_ptr<ParamListener> param_listener_;
100 Params params_;
101 /* Number of wheels on each side of the robot. This is important to take the wheels slip into
102 * account when multiple wheels on each side are present. If there are more wheels then control
103 * signals for each side, you should enter number for control signals. For example, Husky has two
104 * wheels on each side, but they use one control signal, in this case '1' is the correct value of
105 * the parameter. */
106 int wheels_per_side_;
107
108 Odometry odometry_;
109
110 // Timeout to consider cmd_vel commands old
111 rclcpp::Duration cmd_vel_timeout_ = rclcpp::Duration::from_seconds(0.5);
112
113 std::shared_ptr<rclcpp::Publisher<nav_msgs::msg::Odometry>> odometry_publisher_ = nullptr;
114 std::shared_ptr<realtime_tools::RealtimePublisher<nav_msgs::msg::Odometry>>
115 realtime_odometry_publisher_ = nullptr;
116
117 std::shared_ptr<rclcpp::Publisher<tf2_msgs::msg::TFMessage>> odometry_transform_publisher_ =
118 nullptr;
119 std::shared_ptr<realtime_tools::RealtimePublisher<tf2_msgs::msg::TFMessage>>
120 realtime_odometry_transform_publisher_ = nullptr;
121
122 bool subscriber_is_active_ = false;
123 rclcpp::Subscription<TwistStamped>::SharedPtr velocity_command_subscriber_ = nullptr;
124
125 realtime_tools::RealtimeBuffer<std::shared_ptr<TwistStamped>> received_velocity_msg_ptr_{nullptr};
126
127 std::queue<std::array<double, 2>> previous_two_commands_;
128 // speed limiters
129 std::unique_ptr<SpeedLimiter> limiter_linear_;
130 std::unique_ptr<SpeedLimiter> limiter_angular_;
131
132 bool publish_limited_velocity_ = false;
133 std::shared_ptr<rclcpp::Publisher<TwistStamped>> limited_velocity_publisher_ = nullptr;
134 std::shared_ptr<realtime_tools::RealtimePublisher<TwistStamped>>
135 realtime_limited_velocity_publisher_ = nullptr;
136
137 rclcpp::Time previous_update_timestamp_{0};
138
139 // publish rate limiter
140 double publish_rate_ = 50.0;
141 rclcpp::Duration publish_period_ = rclcpp::Duration::from_nanoseconds(0);
142 rclcpp::Time previous_publish_timestamp_{0, 0, RCL_CLOCK_UNINITIALIZED};
143
144 bool is_halted = false;
145
146 bool reset();
147 void halt();
148
149private:
150 void reset_buffers();
151};
152} // namespace diff_drive_controller
153#endif // DIFF_DRIVE_CONTROLLER__DIFF_DRIVE_CONTROLLER_HPP_
Definition chainable_controller_interface.hpp:37
Definition diff_drive_controller.hpp:45
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 diff_drive_controller.cpp:100
bool on_set_chained_mode(bool chained_mode) override
Virtual method that each chainable controller should implement to switch chained mode.
Definition diff_drive_controller.cpp:708
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 diff_drive_controller.cpp:148
controller_interface::InterfaceConfiguration state_interface_configuration() const override
Get configuration for controller's required state interfaces.
Definition diff_drive_controller.cpp:86
controller_interface::CallbackReturn on_init() override
Extending interface with initialization method which is individual for each controller.
Definition diff_drive_controller.cpp:55
std::vector< hardware_interface::CommandInterface > on_export_reference_interfaces() override
Definition diff_drive_controller.cpp:715
controller_interface::InterfaceConfiguration command_interface_configuration() const override
Get configuration for controller's required command interfaces.
Definition diff_drive_controller.cpp:72
Definition odometry.hpp:36
Definition realtime_buffer.hpp:44
Configuring what command/state interfaces to claim.
Definition controller_interface_base.hpp:57
Definition diff_drive_controller.hpp:85