Skip to content

Commit

Permalink
Remove startup delay marker
Browse files Browse the repository at this point in the history
  • Loading branch information
christophfroehlich committed Jul 31, 2024
1 parent a21e60f commit 0c8eca8
Showing 1 changed file with 1 addition and 5 deletions.
6 changes: 1 addition & 5 deletions example_10/test/test_rrbot_launch.py
Original file line number Diff line number Diff line change
Expand Up @@ -38,7 +38,6 @@
from launch.launch_description_sources import PythonLaunchDescriptionSource
from launch_testing.actions import ReadyToTest

import launch_testing
import rclpy
from rclpy.node import Node
from ros2_control_demo_testing.test_utils import (
Expand All @@ -50,11 +49,8 @@

# This function specifies the processes to be run for our test
# The ReadyToTest action waits for 15 second by default for the processes to
# start, if processes take more time an error is thrown. We use decorator here
# to provide timeout duration of 20 second so that processes that take longer than
# 15 seconds can start up.
# start, if processes take more time an error is thrown.
@pytest.mark.launch_test
@launch_testing.ready_to_test_action_timeout(20)
def generate_test_description():
launch_include = IncludeLaunchDescription(
PythonLaunchDescriptionSource(
Expand Down

0 comments on commit 0c8eca8

Please sign in to comment.