We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
1 parent 1bdbddd commit b9c3055Copy full SHA for b9c3055
nav2_mppi_controller/src/path_handler.cpp
@@ -191,11 +191,11 @@ geometry_msgs::msg::PoseStamped PathHandler::getTransformedGoal()
191
auto goal = global_plan_.poses.back();
192
goal.header.stamp = global_plan_.header.stamp;
193
if (goal.header.frame_id.empty()) {
194
- throw std::runtime_error("Goal pose has an empty frame_id");
+ throw nav2_core::ControllerTFError("Goal pose has an empty frame_id");
195
}
196
geometry_msgs::msg::PoseStamped transformed_goal;
197
if (!transformPose(costmap_->getGlobalFrameID(), goal, transformed_goal)) {
198
- throw std::runtime_error("Unable to transform goal pose into costmap frame");
+ throw nav2_core::ControllerTFError("Unable to transform goal pose into costmap frame");
199
200
return transformed_goal;
201
0 commit comments