Skip to content

Commit

Permalink
Merge branch 'master' into fix_multiple_cleanup_on_unconfigured_compo…
Browse files Browse the repository at this point in the history
…nents
  • Loading branch information
anscipione committed Dec 14, 2023
2 parents 653f2d0 + 9055b5b commit 5184402
Show file tree
Hide file tree
Showing 2 changed files with 2 additions and 2 deletions.
2 changes: 1 addition & 1 deletion hardware_interface/doc/mock_components_userdoc.rst
Original file line number Diff line number Diff line change
Expand Up @@ -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 <overview_hardware_components>`.

Features:
Expand Down
2 changes: 1 addition & 1 deletion hardware_interface/src/sensor.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -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)
Expand Down

0 comments on commit 5184402

Please sign in to comment.