diff --git a/launch_testing_ros/test/examples/wait_for_topic_inject_callback.py b/launch_testing_ros/test/examples/wait_for_topic_inject_callback.py index 1e083486..799f7a2e 100644 --- a/launch_testing_ros/test/examples/wait_for_topic_inject_callback.py +++ b/launch_testing_ros/test/examples/wait_for_topic_inject_callback.py @@ -24,7 +24,7 @@ import pytest from std_msgs.msg import String -from axel_launch_testing_ros import WaitForTopics +from launch_testing_ros import WaitForTopics def generate_node():