We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent e2a4751 commit 4546cb7Copy full SHA for 4546cb7
ign_ros2_control/src/ign_ros2_control_plugin.cpp
@@ -428,6 +428,10 @@ void IgnitionROS2ControlPlugin::Configure(
428
std::chrono::duration_cast<std::chrono::nanoseconds>(
429
std::chrono::duration<double>(1.0 / static_cast<double>(this->dataPtr->update_rate))));
430
431
+ // Force setting of use_sime_time parameter
432
+ this->dataPtr->controller_manager_->set_parameter(
433
+ rclcpp::Parameter("use_sim_time", rclcpp::ParameterValue(true)));
434
+
435
this->dataPtr->entity_ = _entity;
436
}
437
0 commit comments