Skip to content

Commit be84f83

Browse files
christophfroehlichmergify[bot]
authored andcommitted
Update include paths of GPL (#264)
(cherry picked from commit 4885811)
1 parent 4b891e5 commit be84f83

File tree

4 files changed

+4
-4
lines changed

4 files changed

+4
-4
lines changed

.github/workflows/abi-compatibility.yml

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -17,6 +17,6 @@ jobs:
1717
- uses: ros-industrial/industrial_ci@master
1818
env:
1919
ROS_DISTRO: ${{ matrix.ROS_DISTRO }}
20-
ROS_REPO: main
20+
ROS_REPO: testing
2121
ABICHECK_URL: github:${{ github.repository }}#${{ github.base_ref }}
2222
NOT_TEST_BUILD: true

include/control_filters/exponential_filter.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -22,7 +22,7 @@
2222
#include "filters/filter_base.hpp"
2323

2424
#include "control_toolbox/filters.hpp"
25-
#include "exponential_filter_parameters.hpp"
25+
#include "control_toolbox/exponential_filter_parameters.hpp"
2626

2727
namespace control_filters
2828
{

include/control_filters/low_pass_filter.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -22,7 +22,7 @@
2222
#include "geometry_msgs/msg/wrench_stamped.hpp"
2323

2424
#include "control_toolbox/low_pass_filter.hpp"
25-
#include "low_pass_filter_parameters.hpp"
25+
#include "control_toolbox/low_pass_filter_parameters.hpp"
2626

2727
namespace control_filters
2828
{

include/control_filters/rate_limiter.hpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -24,7 +24,7 @@
2424
#include "filters/filter_base.hpp"
2525

2626
#include "control_toolbox/rate_limiter.hpp"
27-
#include "rate_limiter_parameters.hpp"
27+
#include "control_toolbox/rate_limiter_parameters.hpp"
2828

2929
namespace control_filters
3030
{

0 commit comments

Comments
 (0)