@@ -125,8 +125,8 @@ controller_server:
125125 # Progress checker parameters
126126 progress_checker :
127127 plugin : " nav2_controller::SimpleProgressChecker"
128- required_movement_radius : 0.1
129- movement_time_allowance : 25 .0
128+ required_movement_radius : 0.5
129+ movement_time_allowance : 10 .0
130130 # Goal checker parameters
131131 # precise_goal_checker:
132132 # plugin: "nav2_controller::SimpleGoalChecker"
@@ -136,85 +136,102 @@ controller_server:
136136 general_goal_checker :
137137 stateful : True
138138 plugin : " nav2_controller::SimpleGoalChecker"
139- xy_goal_tolerance : 0.5
139+ xy_goal_tolerance : 0.25
140140 yaw_goal_tolerance : 0.25
141- # DWB parameters
142141 FollowPath :
143- plugin : " nav2_rotation_shim_controller::RotationShimController"
144- primary_controller : " dwb_core::DWBLocalPlanner"
145- # primary_controller: "nav2_regulated_pure_pursuit_controller::RegulatedPurePursuitController"
146- angular_dist_threshold : 0.1
147- forward_sampling_distance : 0.5
148- rotate_to_heading_angular_vel : 5.0
149- max_angular_accel : 10.0
150- simulate_ahead_time : 1.0
151- rotate_to_goal_heading : true
152-
153- # desired_linear_vel: 2.5
154- # lookahead_dist: 0.6
155- # min_lookahead_dist: 0.3
156- # max_lookahead_dist: 0.9
157- # lookahead_time: 1.5
158- # rotate_to_heading_angular_vel: 5.0
159- # transform_tolerance: 0.1
160- # use_velocity_scaled_lookahead_dist: false
161- # min_approach_linear_velocity: 0.05
162- # approach_velocity_scaling_dist: 1.0
163- # use_collision_detection: true
164- # max_allowed_time_to_collision_up_to_carrot: 1.0
165- # use_regulated_linear_velocity_scaling: true
166- # use_cost_regulated_linear_velocity_scaling: false
167- # regulated_linear_scaling_min_radius: 0.9
168- # regulated_linear_scaling_min_speed: 0.25
169- # use_rotate_to_heading: true
170- # rotate_to_heading_min_angle: 0.785
171- # max_angular_accel: 10.0
172- # max_robot_pose_search_dist: 10.0
173- # use_interpolation: true
174- # cost_scaling_dist: 0.3
175- # cost_scaling_gain: 1.0
176- # inflation_cost_scaling_factor: 1.5
177-
178-
179- debug_trajectory_details : false
180- min_vel_x : -1.0
181- min_vel_y : -1.0
182- max_vel_x : 2.5
183- max_vel_y : 1.0
184- max_vel_theta : 1.0
185- min_speed_xy : 0.0
186- max_speed_xy : 2.5
187- min_speed_theta : 0.0
188- # Add high threshold velocity for turtlebot 3 issue.
189- # https://github.com/ROBOTIS-GIT/turtlebot3_simulations/issues/75
190- acc_lim_x : 2.5
191- acc_lim_y : 2.5
192- acc_lim_theta : 3.2
193- decel_lim_x : -2.5
194- decel_lim_y : 0.0
195- decel_lim_theta : -3.2
196- vx_samples : 20
197- vy_samples : 5
198- vtheta_samples : 20
199- sim_time : 1.7
200- linear_granularity : 0.05
201- angular_granularity : 0.025
202- transform_tolerance : 0.2
203- xy_goal_tolerance : 0.25
204- trans_stopped_velocity : 0.25
205- short_circuit_trajectory_evaluation : True
206- stateful : True
207- critics : ["RotateToGoal", "Oscillation", "BaseObstacle", "GoalAlign", "PathAlign", "PathDist", "GoalDist"]
208- BaseObstacle.scale : 0.02
209- PathAlign.scale : 32.0
210- PathAlign.forward_point_distance : 0.1
211- GoalAlign.scale : 24.0
212- GoalAlign.forward_point_distance : 0.1
213- PathDist.scale : 32.0
214- GoalDist.scale : 24.0
215- RotateToGoal.scale : 32.0
216- RotateToGoal.slowing_factor : 5.0
217- RotateToGoal.lookahead_time : -1.0
142+ plugin : " nav2_mppi_controller::MPPIController"
143+ time_steps : 56
144+ model_dt : 0.05
145+ batch_size : 2000
146+ vx_std : 0.2
147+ vy_std : 0.2
148+ wz_std : 0.4
149+ vx_max : 0.5
150+ vx_min : -0.35
151+ vy_max : 0.5
152+ wz_max : 1.9
153+ iteration_count : 1
154+ prune_distance : 1.7
155+ transform_tolerance : 0.1
156+ temperature : 0.3
157+ gamma : 0.015
158+ motion_model : " DiffDrive"
159+ visualize : false
160+ TrajectoryVisualizer :
161+ trajectory_step : 5
162+ time_step : 3
163+ AckermannConstraints :
164+ min_turning_r : 0.2
165+ critics : ["ConstraintCritic", "CostCritic", "GoalCritic", "GoalAngleCritic", "PathAlignCritic", "PathFollowCritic", "PathAngleCritic", "PreferForwardCritic"]
166+ ConstraintCritic :
167+ enabled : true
168+ cost_power : 1
169+ cost_weight : 4.0
170+ GoalCritic :
171+ enabled : true
172+ cost_power : 1
173+ cost_weight : 5.0
174+ threshold_to_consider : 1.4
175+ GoalAngleCritic :
176+ enabled : true
177+ cost_power : 1
178+ cost_weight : 3.0
179+ threshold_to_consider : 0.5
180+ PreferForwardCritic :
181+ enabled : true
182+ cost_power : 1
183+ cost_weight : 5.0
184+ threshold_to_consider : 0.5
185+ # ObstaclesCritic:
186+ # enabled: true
187+ # cost_power: 1
188+ # repulsion_weight: 1.5
189+ # critical_weight: 20.0
190+ # consider_footprint: false
191+ # collision_cost: 10000.0
192+ # collision_margin_distance: 0.1
193+ # near_goal_distance: 0.5
194+ CostCritic :
195+ enabled : true
196+ cost_power : 1
197+ cost_weight : 3.81
198+ critical_cost : 300.0
199+ consider_footprint : true
200+ collision_cost : 1000000.0
201+ near_goal_distance : 1.0
202+ PathAlignCritic :
203+ PathAlignCritic :
204+ enabled : true
205+ cost_power : 1
206+ cost_weight : 14.0
207+ max_path_occupancy_ratio : 0.05
208+ trajectory_point_step : 3
209+ threshold_to_consider : 0.5
210+ offset_from_furthest : 20
211+ use_path_orientations : false
212+ PathFollowCritic :
213+ enabled : true
214+ cost_power : 1
215+ cost_weight : 5.0
216+ offset_from_furthest : 5
217+ threshold_to_consider : 1.4
218+ PathAngleCritic :
219+ enabled : true
220+ cost_power : 1
221+ cost_weight : 2.0
222+ offset_from_furthest : 4
223+ threshold_to_consider : 0.5
224+ max_angle_to_furthest : 1.0
225+ forward_preference : true
226+ # VelocityDeadbandCritic:
227+ # enabled: true
228+ # cost_power: 1
229+ # cost_weight: 35.0
230+ # deadband_velocities: [0.05, 0.05, 0.05]
231+ # TwirlingCritic:
232+ # enabled: true
233+ # twirling_cost_power: 1
234+ # twirling_cost_weight: 10.0
218235
219236local_costmap :
220237 local_costmap :
@@ -384,10 +401,10 @@ velocity_smoother:
384401 smoothing_frequency : 20.0
385402 scale_velocities : False
386403 feedback : " OPEN_LOOP"
387- max_velocity : [2.5, 2.5, 10 .0]
388- min_velocity : [-2.5, -2.5 , -10 .0]
389- max_accel : [2.5, 2.5, 100.0 ]
390- max_decel : [-2.5, -2.5 , -100.0 ]
404+ max_velocity : [0.26, 0.0, 1 .0]
405+ min_velocity : [-0.26, 0.0 , -1 .0]
406+ max_accel : [2.5, 0.0, 3.2 ]
407+ max_decel : [-2.5, 0.0 , -3.2 ]
391408 odom_topic : " odom"
392409 odom_duration : 0.1
393410 deadband_velocity : [0.0, 0.0, 0.0]
0 commit comments