Skip to content

Commit 850c588

Browse files
committed
Add rmw zenoh cpp to ci
Signed-off-by: mini-1235 <[email protected]>
1 parent 4e5273a commit 850c588

File tree

4 files changed

+10
-1
lines changed

4 files changed

+10
-1
lines changed

.circleci/config.yml

Lines changed: 6 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -234,6 +234,10 @@ _commands:
234234
name: Test Workspace | << parameters.workspace >>
235235
working_directory: << parameters.workspace >>
236236
command: |
237+
# Start zenohd daemon only if using rmw_zenoh_cpp
238+
if [ "$RMW_IMPLEMENTATION" = "rmw_zenoh_cpp" ]; then
239+
ros2 run rmw_zenoh_cpp rmw_zenohd &
240+
fi
237241
TEST_UNPASSED=$(
238242
colcon list \
239243
--names-only \
@@ -503,7 +507,7 @@ _jobs:
503507
type: boolean
504508
default: false
505509
rmw:
506-
default: "rmw_cyclonedds_cpp"
510+
default: "rmw_zenoh_cpp"
507511
type: string
508512
parallelism: 1
509513
environment:
@@ -564,6 +568,7 @@ workflows:
564568
rmw:
565569
- rmw_cyclonedds_cpp
566570
- rmw_fastrtps_cpp
571+
- rmw_zenoh_cpp
567572
triggers:
568573
- schedule:
569574
cron: "0 13 * * *"

Dockerfile

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -57,6 +57,7 @@ RUN apt-get update && \
5757
ros-$ROS_DISTRO-rmw-fastrtps-cpp \
5858
ros-$ROS_DISTRO-rmw-connextdds \
5959
ros-$ROS_DISTRO-rmw-cyclonedds-cpp \
60+
ros-$ROS_DISTRO-rmw-zenoh-cpp \
6061
&& pip3 install --break-system-packages \
6162
fastcov \
6263
git+https://github.com/ruffsl/colcon-cache.git@a937541bfc496c7a267db7ee9d6cceca61e470ca \

nav2_behavior_tree/test/plugins/decorator/test_distance_controller.cpp

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -30,6 +30,7 @@ class DistanceControllerTestFixture : public nav2_behavior_tree::BehaviorTreeTes
3030
public:
3131
void SetUp()
3232
{
33+
node_->declare_parameter("transform_tolerance", rclcpp::ParameterValue{0.1});
3334
config_->input_ports["distance"] = 1.0;
3435
config_->input_ports["global_frame"] = "map";
3536
config_->input_ports["robot_base_frame"] = "base_link";

nav2_smac_planner/test/test_a_star.cpp

Lines changed: 2 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -526,6 +526,8 @@ TEST(AStarTest, test_goal_heading_mode)
526526
a_star.setGoal(
527527
80u, 80u, 10u,
528528
nav2_smac_planner::GoalHeadingMode::UNKNOWN), std::runtime_error);
529+
delete costmapA;
530+
nav2_smac_planner::NodeHybrid::destroyStaticAssets();
529531
}
530532

531533
TEST(AStarTest, test_constants)

0 commit comments

Comments
 (0)