File tree Expand file tree Collapse file tree 1 file changed +3
-2
lines changed Expand file tree Collapse file tree 1 file changed +3
-2
lines changed Original file line number Diff line number Diff line change @@ -171,7 +171,7 @@ class GazeboSimROS2ControlPluginPrivate
171
171
172
172
// / \brief Last time the update method was called
173
173
rclcpp::Time last_update_sim_time_ros_ =
174
- rclcpp::Time (( int64_t ) 0 , RCL_ROS_TIME);
174
+ rclcpp::Time (static_cast < int64_t >( 0 ) , RCL_ROS_TIME);
175
175
176
176
// / \brief ECM pointer
177
177
sim::EntityComponentManager * ecm{nullptr };
@@ -458,7 +458,8 @@ void GazeboSimROS2ControlPlugin::Configure(
458
458
this ->dataPtr ->node_ ->get_namespace (), options));
459
459
this ->dataPtr ->executor_ ->add_node (this ->dataPtr ->controller_manager_ );
460
460
461
- this ->dataPtr ->update_rate = this ->dataPtr ->controller_manager_ ->get_update_rate ();
461
+ this ->dataPtr ->update_rate =
462
+ static_cast <int >(this ->dataPtr ->controller_manager_ ->get_update_rate ());
462
463
this ->dataPtr ->control_period_ = rclcpp::Duration (
463
464
std::chrono::duration_cast<std::chrono::nanoseconds>(
464
465
std::chrono::duration<double >(1.0 / static_cast <double >(this ->dataPtr ->update_rate ))));
You can’t perform that action at this time.
0 commit comments