diff --git a/hardware_interface/doc/mock_components_userdoc.rst b/hardware_interface/doc/mock_components_userdoc.rst index 573037a58d..4b54d5fa00 100644 --- a/hardware_interface/doc/mock_components_userdoc.rst +++ b/hardware_interface/doc/mock_components_userdoc.rst @@ -14,7 +14,7 @@ The main intention is to reduce debugging time on the physical hardware and boos Generic System ^^^^^^^^^^^^^^ -The component implements ``hardware_interface::SystemInterface>`` supporting command and state interfaces. +The component implements ``hardware_interface::SystemInterface`` supporting command and state interfaces. For more information about hardware components check :ref:`detailed documentation `. Features: diff --git a/hardware_interface/src/sensor.cpp b/hardware_interface/src/sensor.cpp index e61cca2aa2..84a3aaf2f0 100644 --- a/hardware_interface/src/sensor.cpp +++ b/hardware_interface/src/sensor.cpp @@ -201,7 +201,7 @@ return_type Sensor::read(const rclcpp::Time & time, const rclcpp::Duration & per { return return_type::OK; } - + if ( impl_->get_state().id() == lifecycle_msgs::msg::State::PRIMARY_STATE_INACTIVE || impl_->get_state().id() == lifecycle_msgs::msg::State::PRIMARY_STATE_ACTIVE)