Skip to content

Commit

Permalink
Fix subversion ..
Browse files Browse the repository at this point in the history
  • Loading branch information
sjahr committed Aug 23, 2024
1 parent e32e6c6 commit e6119d2
Showing 1 changed file with 1 addition and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -40,7 +40,7 @@
#include <rclcpp/version.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_ros/message_filter.h>
#if RCLCPP_VERSION_GTE(28, 3, 0) // Rolling
#if RCLCPP_VERSION_GTE(28, 3, 3) // Rolling
#include <message_filters/subscriber.hpp>
#else
#include <message_filters/subscriber.h>
Expand Down

0 comments on commit e6119d2

Please sign in to comment.