Skip to content

Commit

Permalink
demote wait_for_fmu message
Browse files Browse the repository at this point in the history
  • Loading branch information
GuillaumeLaine authored and bkueng committed Jul 19, 2024
1 parent 0dc23b3 commit 411b3b1
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion px4_ros2_cpp/src/components/wait_for_fmu.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -13,7 +13,7 @@ bool waitForFMU(
rclcpp::Node & node, const rclcpp::Duration & timeout,
const std::string & topic_namespace_prefix)
{
RCLCPP_INFO(node.get_logger(), "Waiting for FMU...");
RCLCPP_DEBUG(node.get_logger(), "Waiting for FMU...");
const rclcpp::Subscription<px4_msgs::msg::VehicleStatus>::SharedPtr vehicle_status_sub =
node.create_subscription<px4_msgs::msg::VehicleStatus>(
topic_namespace_prefix + "fmu/out/vehicle_status", rclcpp::QoS(1).best_effort(),
Expand Down

0 comments on commit 411b3b1

Please sign in to comment.