Skip to content
Open
Show file tree
Hide file tree
Changes from all commits
Commits
Show all changes
53 commits
Select commit Hold shift + click to select a range
768ef15
Add additional tests
wittenator Mar 1, 2025
e22df84
Merge branch 'ros-controls:master' into master
wittenator Mar 1, 2025
36bc9d5
Remove twist_input from closed loop odometry calculation
wittenator Mar 1, 2025
94eebd0
Merge branch 'ros-controls:master' into master
wittenator Mar 1, 2025
c0f103e
Add in missing test case
wittenator Mar 1, 2025
0564ada
Merge branch 'master' of github.com:wittenator/ros2_controllers
wittenator Mar 1, 2025
eaebf09
Fixed comment
wittenator Mar 1, 2025
3e84edd
Update on ackermann message
wittenator Mar 1, 2025
4f14831
Merge branch 'master' into master
wittenator Mar 3, 2025
e20e63c
Merge branch 'master' into master
wittenator Mar 4, 2025
031ddc6
Merge branch 'master' into master
christophfroehlich Mar 19, 2025
7564e34
Merge branch 'master' into master
wittenator Apr 6, 2025
0c3ded5
Fix reference name
wittenator Apr 6, 2025
a15dc7f
Merge branch 'master' of github.com:wittenator/ros2_controllers
wittenator Apr 6, 2025
66effcf
Merge branch 'ros-controls:master' into master
wittenator Apr 10, 2025
d204e7e
Fix typo
wittenator Apr 10, 2025
948b67c
Merge branch 'master' of github.com:wittenator/ros2_controllers
wittenator Apr 10, 2025
c612f3c
Fix tests
wittenator Apr 10, 2025
915e3bd
Fix exported interfaces tests
wittenator Apr 11, 2025
b038514
Add comment
wittenator Apr 11, 2025
b79d682
Ran precommit hooks
wittenator Apr 11, 2025
f9f2459
Fix all pre-commit checks
wittenator Apr 11, 2025
3782090
Update function description
wittenator Apr 11, 2025
aae242d
Merge branch 'ros-controls:master' into master
wittenator Apr 12, 2025
abbe4fd
Fix missed readability issue
wittenator Apr 14, 2025
fc881c2
Merge branch 'master' of github.com:wittenator/ros2_controllers
wittenator Apr 14, 2025
5a6e60e
Switch from double to float for drive messages in tests
wittenator Apr 14, 2025
ed3ef21
Explicitly cast default parameters to float
wittenator Apr 14, 2025
8b65ff9
Merge branch 'ros-controls:master' into master
wittenator Apr 17, 2025
976935a
Merge branch 'master' into master
wittenator Apr 24, 2025
bb27729
Fixed tests again
wittenator Apr 26, 2025
b42d13a
Merge branch 'ros-controls:master' into master
wittenator Apr 26, 2025
c367db2
Merge branch 'master' into master
wittenator Apr 27, 2025
3436bb0
Merge branch 'master' into master
wittenator Apr 27, 2025
8d9cc8e
Merge branch 'ros-controls:master' into master
wittenator May 18, 2025
8a60aa3
Renamed message naming
wittenator May 18, 2025
f159c60
Merge remote-tracking branch 'origin/master' into wittenator/master
christophfroehlich May 28, 2025
1fd197c
Merge branch 'ros-controls:master' into master
wittenator Jun 9, 2025
9c8bb76
Rename various tests and variables
wittenator Jun 9, 2025
f150a9b
Merge commit
wittenator Jun 9, 2025
d01dd0f
Merge branch 'master' of github.com:wittenator/ros2_controllers
wittenator Jun 12, 2025
1b7cf57
Fix formatting
wittenator Jun 12, 2025
990d2fe
Merge branch 'master' into master
wittenator Jun 12, 2025
ef29f5f
Added consistent naming in tests and fixed docs
wittenator Jun 12, 2025
9d8bd04
Merge branch 'master' of github.com:wittenator/ros2_controllers
wittenator Jun 12, 2025
aebb8be
Merge remote-tracking branch 'upstream/master'
wittenator Aug 11, 2025
39dafe9
fix tests
wittenator Aug 11, 2025
ed7a782
Format with precommit
wittenator Aug 11, 2025
3f64a4d
Merge branch 'ros-controls:master' into master
wittenator Sep 28, 2025
dd64226
Merge branch 'ros-controls:master' into master
wittenator Oct 18, 2025
e0a58db
Revert naming in doc string
wittenator Oct 18, 2025
48a66cc
Integrated more feedback
wittenator Oct 18, 2025
4adb592
Merge branch 'master' of github.com:wittenator/ros2_controllers
wittenator Oct 18, 2025
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
Original file line number Diff line number Diff line change
Expand Up @@ -59,7 +59,8 @@ bool AckermannSteeringController::update_odometry(const rclcpp::Duration & perio

if (params_.open_loop)
{
odometry_.update_open_loop(last_linear_velocity_, last_angular_velocity_, period.seconds());
odometry_.update_open_loop(
last_linear_velocity_, last_angular_velocity_, period.seconds(), params_.use_twist_input);
}
else
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -103,7 +103,7 @@ TEST_F(AckermannSteeringControllerTest, activate_success)
ASSERT_EQ(controller_->on_activate(rclcpp_lifecycle::State()), NODE_SUCCESS);

// check that the message is reset
auto msg = controller_->input_ref_.get();
auto msg = controller_->input_ref_twist_.get();
EXPECT_TRUE(std::isnan(msg.twist.linear.x));
EXPECT_TRUE(std::isnan(msg.twist.linear.y));
EXPECT_TRUE(std::isnan(msg.twist.linear.z));
Expand Down Expand Up @@ -165,7 +165,7 @@ TEST_F(AckermannSteeringControllerTest, test_update_logic)
msg.header.stamp = controller_->get_node()->now();
msg.twist.linear.x = 0.1;
msg.twist.angular.z = 0.2;
controller_->input_ref_.set(msg);
controller_->input_ref_twist_.set(msg);

ASSERT_EQ(
controller_->update(rclcpp::Time(0, 0, RCL_ROS_TIME), rclcpp::Duration::from_seconds(0.01)),
Expand All @@ -185,7 +185,7 @@ TEST_F(AckermannSteeringControllerTest, test_update_logic)
controller_->command_interfaces_[CMD_STEER_LEFT_WHEEL].get_optional().value(),
1.4179821977774734, COMMON_THRESHOLD);

EXPECT_FALSE(std::isnan(controller_->input_ref_.get().twist.linear.x));
EXPECT_FALSE(std::isnan(controller_->input_ref_twist_.get().twist.linear.x));
EXPECT_EQ(controller_->reference_interfaces_.size(), joint_reference_interfaces_.size());
for (const auto & interface : controller_->reference_interfaces_)
{
Expand Down Expand Up @@ -225,7 +225,7 @@ TEST_F(AckermannSteeringControllerTest, test_update_logic_chained)
controller_->command_interfaces_[STATE_STEER_LEFT_WHEEL].get_optional().value(),
1.4179821977774734, COMMON_THRESHOLD);

EXPECT_TRUE(std::isnan(controller_->input_ref_.get().twist.linear.x));
EXPECT_TRUE(std::isnan(controller_->input_ref_twist_.get().twist.linear.x));
EXPECT_EQ(controller_->reference_interfaces_.size(), joint_reference_interfaces_.size());
for (const auto & interface : controller_->reference_interfaces_)
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -49,7 +49,8 @@ bool BicycleSteeringController::update_odometry(const rclcpp::Duration & period)

if (params_.open_loop)
{
odometry_.update_open_loop(last_linear_velocity_, last_angular_velocity_, period.seconds());
odometry_.update_open_loop(
last_linear_velocity_, last_angular_velocity_, period.seconds(), params_.use_twist_input);
}
else
{
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -89,7 +89,7 @@ TEST_F(BicycleSteeringControllerTest, activate_success)
ASSERT_EQ(controller_->on_activate(rclcpp_lifecycle::State()), NODE_SUCCESS);

// check that the message is reset
auto msg = controller_->input_ref_.get();
auto msg = controller_->input_ref_twist_.get();
EXPECT_TRUE(std::isnan(msg.twist.linear.x));
EXPECT_TRUE(std::isnan(msg.twist.linear.y));
EXPECT_TRUE(std::isnan(msg.twist.linear.z));
Expand Down Expand Up @@ -151,7 +151,7 @@ TEST_F(BicycleSteeringControllerTest, test_update_logic)
msg.header.stamp = controller_->get_node()->now();
msg.twist.linear.x = 0.1;
msg.twist.angular.z = 0.2;
controller_->input_ref_.set(msg);
controller_->input_ref_twist_.set(msg);

ASSERT_EQ(
controller_->update(rclcpp::Time(0, 0, RCL_ROS_TIME), rclcpp::Duration::from_seconds(0.01)),
Expand All @@ -164,7 +164,7 @@ TEST_F(BicycleSteeringControllerTest, test_update_logic)
controller_->command_interfaces_[CMD_STEER_WHEEL].get_optional().value(), 1.4179821977774734,
COMMON_THRESHOLD);

EXPECT_FALSE(std::isnan(controller_->input_ref_.get().twist.linear.x));
EXPECT_FALSE(std::isnan(controller_->input_ref_twist_.get().twist.linear.x));
EXPECT_EQ(controller_->reference_interfaces_.size(), joint_reference_interfaces_.size());
for (const auto & interface : controller_->reference_interfaces_)
{
Expand Down Expand Up @@ -197,7 +197,7 @@ TEST_F(BicycleSteeringControllerTest, test_update_logic_chained)
controller_->command_interfaces_[CMD_STEER_WHEEL].get_optional().value(), 1.4179821977774734,
COMMON_THRESHOLD);

EXPECT_TRUE(std::isnan(controller_->input_ref_.get().twist.linear.x));
EXPECT_TRUE(std::isnan(controller_->input_ref_twist_.get().twist.linear.x));
EXPECT_EQ(controller_->reference_interfaces_.size(), joint_reference_interfaces_.size());
for (const auto & interface : controller_->reference_interfaces_)
{
Expand Down
7 changes: 6 additions & 1 deletion steering_controllers_library/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -72,9 +72,14 @@ if(BUILD_TESTING)
target_include_directories(test_steering_controllers_library PRIVATE include)
target_link_libraries(test_steering_controllers_library steering_controllers_library)

add_rostest_with_parameters_gmock(
test_steering_controllers_library_steering_input test/test_steering_controllers_library_steering_input.cpp
${CMAKE_CURRENT_SOURCE_DIR}/test/steering_controllers_library_steering_input_params.yaml)
target_include_directories(test_steering_controllers_library_steering_input PRIVATE include)
target_link_libraries(test_steering_controllers_library_steering_input steering_controllers_library)

ament_add_gmock(test_steering_odometry test/test_steering_odometry.cpp)
target_link_libraries(test_steering_odometry steering_controllers_library)

endif()

install(
Expand Down
14 changes: 11 additions & 3 deletions steering_controllers_library/doc/userdoc.rst
Original file line number Diff line number Diff line change
Expand Up @@ -6,6 +6,7 @@ steering_controllers_library
=============================

.. _steering_controller_status_msg: https://github.com/ros-controls/control_msgs/blob/master/control_msgs/msg/SteeringControllerStatus.msg
.. _steering_controller_command_msg: https://github.com/ros-controls/control_msgs/blob/master/control_msgs/msg/SteeringControllerCommand.msg
.. _odometry_msg: https://github.com/ros2/common_interfaces/blob/{DISTRO}/nav_msgs/msg/Odometry.msg
.. _twist_msg: https://github.com/ros2/common_interfaces/blob/{DISTRO}/geometry_msgs/msg/TwistStamped.msg
.. _tf_msg: https://github.com/ros2/geometry2/blob/{DISTRO}/tf2_msgs/msg/TFMessage.msg
Expand All @@ -21,7 +22,7 @@ For an introduction to mobile robot kinematics and the nomenclature used here, s
Execution logic of the controller
----------------------------------

The controller uses velocity input, i.e., stamped `twist messages <twist_msg_>`_ where linear ``x`` and angular ``z`` components are used.
The controller uses velocity input, i.e., stamped `twist messages <twist_msg_>`_ where linear ``x`` and angular ``z`` components are used if ``twist_input == true``. If ``twist_input == false``, the controller uses `control_msgs/msg/SteeringControllerStatus <steering_controller_status_msg_>`_ where linear ``speed`` and angular ``steering_angle`` components are used.
Copy link
Contributor

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

Could we add more context for the inputs, for example

The controller uses velocity input, i.e., stamped `twist messages <twist_msg_>`_ where:
- **Linear velocity (`linear x`)**: Represents the forward/backward motion of the robot along its x-axis (in meters per second, m/s).
- **Angular velocity (`angular z`)**: Represents the rotational motion of the robot around its z-axis (in radians per second, rad/s).

These components are used when ``twist_input == true``. 

If ``twist_input == false``, the controller uses `control_msgs/msg/SteeringControllerStatus <steering_controller_status_msg_>`_ where:
- **Speed (`speed`)**: Represents the linear speed of the robot (in meters per second, m/s).
- **Steering angle (`steering_angle`)**: Represents the angle of the steering joints (in radians, rad).

Values in other components are ignored.

Copy link
Author

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

Sure, I can add this. One thing that comes up then is: What is a good way to describe the steering angle? The exact positions of the joints and wheels depends on both the steering angle as an abstract value and the exact kinematic setup of the robot. For an Ackermann steering geometry, the positions of the joints are different from each other and from the steering angle, so I had trouble finding a fitting description of it without mentioning something like a steering wheel or some common element that links the steering joints.

Copy link
Contributor

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

Copy link
Contributor

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

one could define the steering angle with the ICR being perpendicular to the imaginary single steering wheel.

Copy link
Author

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

I've added a small overview for both cases that describe the inputs and their physical equivalent in the docs.

Values in other components are ignored.

In the chain mode the controller provides two reference interfaces, one for linear velocity and one for steering angle position.
Expand Down Expand Up @@ -82,9 +83,16 @@ With the following state interfaces:
Subscribers
,,,,,,,,,,,,

Used when controller is not in chained mode (``in_chained_mode == false``).

Used when controller is not in chained mode (``in_chained_mode == false``) and the twist input mode is activated (``twist_input == true``):
- ``<controller_name>/reference`` [`geometry_msgs/msg/TwistStamped <twist_msg_>`_]
In this configuration the controller uses :
- **Linear Velocity (`linear`)**: Represents the linear speed of the robot (in meters per second, m/s).
- **Angular Velocity (`angular`)**: Represents the angular speed of the robot (in meters per second, m/s).
When the controller is not in chained mode (``in_chained_mode == false``) and the twist input mode is not activated (``twist_input == false``):
- ``<controller_name>/reference`` [`control_msgs/msg/SteeringControllerCommand <steering_controller_command_msg_>`_]
In this configuration the controller uses :
- **Linear Velocity (`speed`)**: Represents the linear velocity of the robot (in meters per second, m/s).
- **Steering angle (`steering_angle`)**: Represents the angle of the imaginary, central steering wheel relative to the vehicle’s longitudinal axis. Specific angles for individual steering joints are computed internally based on the kinematic model of the robot. (in radians, rad)

Publishers
,,,,,,,,,,,
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -22,11 +22,13 @@

#include "controller_interface/chainable_controller_interface.hpp"
#include "hardware_interface/handle.hpp"
#include "rclcpp/duration.hpp"
#include "rclcpp_lifecycle/state.hpp"
#include "realtime_tools/realtime_publisher.hpp"
#include "realtime_tools/realtime_thread_safe_box.hpp"

// TODO(anyone): Replace with controller specific messages
#include "control_msgs/msg/steering_controller_command.hpp"
#include "control_msgs/msg/steering_controller_status.hpp"
#include "geometry_msgs/msg/twist_stamped.hpp"
#include "nav_msgs/msg/odometry.hpp"
Expand Down Expand Up @@ -70,6 +72,7 @@ class SteeringControllersLibrary : public controller_interface::ChainableControl
const rclcpp::Time & time, const rclcpp::Duration & period) override;

using ControllerTwistReferenceMsg = geometry_msgs::msg::TwistStamped;
using ControllerSteeringReferenceMsg = control_msgs::msg::SteeringControllerCommand;
using ControllerStateMsgOdom = nav_msgs::msg::Odometry;
using ControllerStateMsgTf = tf2_msgs::msg::TFMessage;
using SteeringControllerStateMsg = control_msgs::msg::SteeringControllerStatus;
Expand All @@ -81,14 +84,17 @@ class SteeringControllersLibrary : public controller_interface::ChainableControl
std::shared_ptr<steering_controllers_library::ParamListener> param_listener_;
steering_controllers_library::Params params_;

// the RT Box containing the command message
realtime_tools::RealtimeThreadSafeBox<ControllerTwistReferenceMsg> input_ref_;
// save the last reference in case of unable to get value from box
ControllerTwistReferenceMsg current_ref_;
rclcpp::Duration ref_timeout_ = rclcpp::Duration::from_seconds(0.0); // 0ms

// Command subscribers and Controller State publisher
rclcpp::Subscription<ControllerTwistReferenceMsg>::SharedPtr ref_subscriber_twist_ = nullptr;
rclcpp::Subscription<ControllerSteeringReferenceMsg>::SharedPtr ref_subscriber_steering_ =
nullptr;
// the RT Box containing the command messages
realtime_tools::RealtimeThreadSafeBox<ControllerTwistReferenceMsg> input_ref_twist_;
realtime_tools::RealtimeThreadSafeBox<ControllerSteeringReferenceMsg> input_ref_steering_;
// save the last references in case of unable to get value from box
ControllerTwistReferenceMsg current_ref_twist_;
ControllerSteeringReferenceMsg current_ref_steering_;
rclcpp::Duration ref_timeout_ = rclcpp::Duration::from_seconds(0.0); // 0ms
using ControllerStatePublisherOdom = realtime_tools::RealtimePublisher<ControllerStateMsgOdom>;
using ControllerStatePublisherTf = realtime_tools::RealtimePublisher<ControllerStateMsgTf>;

Expand Down Expand Up @@ -131,7 +137,8 @@ class SteeringControllersLibrary : public controller_interface::ChainableControl

private:
// callback for topic interface
void reference_callback(const std::shared_ptr<ControllerTwistReferenceMsg> msg);
void reference_callback_twist(const std::shared_ptr<ControllerTwistReferenceMsg> msg);
void reference_callback_steering(const std::shared_ptr<ControllerSteeringReferenceMsg> msg);
};

} // namespace steering_controllers_library
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -136,8 +136,10 @@ class SteeringOdometry
* \param v_bx Linear velocity [m/s]
* \param omega_bz Angular velocity [rad/s]
* \param dt time difference to last call
* \param use_twist_input If true, the input is twist, otherwise it is steering angle
*/
void update_open_loop(const double v_bx, const double omega_bz, const double dt);
void update_open_loop(
const double v_bx, const double omega_bz, const double dt, const bool use_twist_input = true);

/**
* \brief Set odometry type
Expand Down Expand Up @@ -206,12 +208,14 @@ class SteeringOdometry
* \param omega_bz Desired angular velocity of the robot around x_z-axis
* \param open_loop If false, the IK will be calculated using measured steering angle
* \param reduce_wheel_speed_until_steering_reached Reduce wheel speed until the steering angle
* \param use_twist_input If true, the input is twist, otherwise it is steering angle
* has been reached
* \return Tuple of velocity commands and steering commands
*/
std::tuple<std::vector<double>, std::vector<double>> get_commands(
const double v_bx, const double omega_bz, const bool open_loop = true,
const bool reduce_wheel_speed_until_steering_reached = false);
const bool reduce_wheel_speed_until_steering_reached = false,
const bool use_twist_input = true);

/**
* \brief Reset poses, heading, and accumulators
Expand Down Expand Up @@ -250,6 +254,13 @@ class SteeringOdometry
*/
double convert_twist_to_steering_angle(const double v_bx, const double omega_bz);

/**
* \brief Calculates angular velocity from the steering angle and linear velocity
* \param v_bx Linear velocity of the robot in x_b-axis direction
* \param phi Steering angle
*/
double convert_steering_angle_to_angular_velocity(double v_bx, double phi);

/**
* \brief Calculates linear velocity of a robot with double traction axle
* \param right_traction_wheel_vel Right traction wheel velocity [rad/s]
Expand Down
Loading