File tree Expand file tree Collapse file tree 1 file changed +8
-8
lines changed
nav2_dwb_controller/dwb_plugins/src Expand file tree Collapse file tree 1 file changed +8
-8
lines changed Original file line number Diff line number Diff line change @@ -155,10 +155,10 @@ void KinematicsHandler::setSpeedLimit(
155155 const double & speed_limit, const bool & percentage)
156156{
157157 KinematicParameters* ptr = kinematics_.load ();
158- if (ptr == nullptr ) {
159- return ; // Nothing to update
160- }
161- KinematicParameters kinematics (*ptr);
158+ if (ptr == nullptr ) {
159+ return ; // Nothing to update
160+ }
161+ KinematicParameters kinematics (*ptr);
162162
163163 if (speed_limit == nav2_costmap_2d::NO_SPEED_LIMIT) {
164164 // Restore default value
@@ -240,10 +240,10 @@ KinematicsHandler::updateParametersCallback(std::vector<rclcpp::Parameter> param
240240{
241241 rcl_interfaces::msg::SetParametersResult result;
242242 KinematicParameters* ptr = kinematics_.load ();
243- if (ptr == nullptr ) {
244- return ; // Nothing to update
245- }
246- KinematicParameters kinematics (*ptr);
243+ if (ptr == nullptr ) {
244+ return ; // Nothing to update
245+ }
246+ KinematicParameters kinematics (*ptr);
247247
248248 for (auto parameter : parameters) {
249249 const auto & param_type = parameter.get_type ();
You can’t perform that action at this time.
0 commit comments