File tree Expand file tree Collapse file tree 1 file changed +0
-12
lines changed
nav2_collision_monitor/test Expand file tree Collapse file tree 1 file changed +0
-12
lines changed Original file line number Diff line number Diff line change @@ -64,8 +64,6 @@ static const double SIMULATION_TIME_STEP{0.01};
6464static const double TRANSFORM_TOLERANCE{0.5 };
6565static const double SOURCE_TIMEOUT{5.0 };
6666static const double STOP_PUB_TIMEOUT{0.1 };
67- static const bool USE_GLOBAL_HEIGHT{false };
68- static const double MIN_HEIGHT{0.1 };
6967
7068enum PolygonType
7169{
@@ -345,16 +343,6 @@ void Tester::setCommonParameters()
345343 " stop_pub_timeout" , rclcpp::ParameterValue (STOP_PUB_TIMEOUT));
346344 cm_->set_parameter (
347345 rclcpp::Parameter (" stop_pub_timeout" , STOP_PUB_TIMEOUT));
348-
349- // cm_->declare_parameter(
350- // "use_global_height", rclcpp::ParameterValue(USE_GLOBAL_HEIGHT));
351- // cm_->set_parameter(
352- // rclcpp::Parameter("use_global_height", USE_GLOBAL_HEIGHT));
353-
354- // cm_->declare_parameter(
355- // "min_height", rclcpp::ParameterValue(MIN_HEIGHT));
356- // cm_->set_parameter(
357- // rclcpp::Parameter("min_height", MIN_HEIGHT));
358346}
359347
360348void Tester::addPolygon (
You can’t perform that action at this time.
0 commit comments