38 #include "nav2_costmap_2d/costmap_filters/keepout_filter.hpp"
43 #include "tf2/convert.hpp"
44 #include "tf2_geometry_msgs/tf2_geometry_msgs.hpp"
46 #include "nav2_costmap_2d/costmap_filters/filter_values.hpp"
47 #include "nav2_util/geometry_utils.hpp"
48 #include "nav2_util/occ_grid_utils.hpp"
54 : filter_info_sub_(nullptr), mask_sub_(nullptr), filter_mask_(nullptr),
60 const std::string & filter_info_topic)
62 std::lock_guard<CostmapFilter::mutex_t> guard(*
getMutex());
64 nav2::LifecycleNode::SharedPtr node = node_.lock();
66 throw std::runtime_error{
"Failed to lock node"};
73 "KeepoutFilter: Subscribing to \"%s\" topic for filter info...",
75 filter_info_sub_ = node->create_subscription<nav2_msgs::msg::CostmapFilterInfo>(
77 std::bind(&KeepoutFilter::filterInfoCallback,
this, std::placeholders::_1),
80 global_frame_ = layered_costmap_->getGlobalFrameID();
83 node->get_parameter(name_ +
"." +
"override_lethal_cost", override_lethal_cost_);
84 declareParameter(
"lethal_override_cost", rclcpp::ParameterValue(MAX_NON_OBSTACLE));
85 node->get_parameter(name_ +
"." +
"lethal_override_cost", lethal_override_cost_);
88 lethal_override_cost_ = \
89 std::clamp<unsigned int>(lethal_override_cost_, FREE_SPACE, MAX_NON_OBSTACLE);
90 lethal_state_update_max_x_ = lethal_state_update_max_y_ = std::numeric_limits<double>::lowest();
91 lethal_state_update_min_x_ = lethal_state_update_min_y_ = std::numeric_limits<double>::max();
94 void KeepoutFilter::filterInfoCallback(
95 const nav2_msgs::msg::CostmapFilterInfo::SharedPtr msg)
97 std::lock_guard<CostmapFilter::mutex_t> guard(*
getMutex());
99 nav2::LifecycleNode::SharedPtr node = node_.lock();
101 throw std::runtime_error{
"Failed to lock node"};
111 "KeepoutFilter: New costmap filter info arrived from %s topic. Updating old filter info.",
118 if (msg->base != BASE_DEFAULT || msg->multiplier != MULTIPLIER_DEFAULT) {
121 "KeepoutFilter: For proper use of keepout filter base and multiplier"
122 " in CostmapFilterInfo message should be set to their default values (%f and %f)",
123 BASE_DEFAULT, MULTIPLIER_DEFAULT);
131 "KeepoutFilter: Subscribing to \"%s\" topic for filter mask...",
133 mask_sub_ = node->create_subscription<nav_msgs::msg::OccupancyGrid>(
135 std::bind(&KeepoutFilter::maskCallback,
this, std::placeholders::_1),
139 void KeepoutFilter::maskCallback(
140 const nav_msgs::msg::OccupancyGrid::SharedPtr msg)
142 std::lock_guard<CostmapFilter::mutex_t> guard(*
getMutex());
144 nav2::LifecycleNode::SharedPtr node = node_.lock();
146 throw std::runtime_error{
"Failed to lock node"};
152 "KeepoutFilter: Received filter mask from %s topic.",
mask_topic_.c_str());
156 "KeepoutFilter: New filter mask arrived from %s topic. Updating old filter mask.",
158 filter_mask_.reset();
163 has_updated_data_ =
true;
165 width_ = msg->info.width;
166 height_ = msg->info.height;
170 double robot_x,
double robot_y,
double robot_yaw,
171 double * min_x,
double * min_y,
double * max_x,
double * max_y)
180 if(has_updated_data_) {
183 *min_x = std::min(wx, *min_x);
184 *min_y = std::min(wy, *min_y);
187 *max_x = std::max(wx, *max_x);
188 *max_y = std::max(wy, *max_y);
190 has_updated_data_ =
false;
195 is_pose_lethal_ =
false;
196 if (override_lethal_cost_) {
197 geometry_msgs::msg::Pose pose;
198 pose.position.x = robot_x;
199 pose.position.y = robot_y;
200 pose.position.z = 0.0;
201 pose.orientation = nav2_util::geometry_utils::orientationAroundZAxis(robot_yaw);
202 geometry_msgs::msg::Pose mask_pose;
203 if (
transformPose(global_frame_, pose, filter_mask_->header.frame_id, mask_pose)) {
204 unsigned int mask_robot_i, mask_robot_j;
205 if (nav2_util::worldToMap(filter_mask_, mask_pose.position.x, mask_pose.position.y,
206 mask_robot_i, mask_robot_j))
208 auto data =
getMaskCost(filter_mask_, mask_robot_i, mask_robot_j);
209 is_pose_lethal_ = (data == INSCRIBED_INFLATED_OBSTACLE || data == LETHAL_OBSTACLE);
210 if (is_pose_lethal_) {
211 RCLCPP_WARN_THROTTLE(
212 logger_, *(clock_), 2000,
213 "KeepoutFilter: Pose is in keepout zone, reducing cost override to navigate out.");
220 if (is_pose_lethal_ || (last_pose_lethal_ && !is_pose_lethal_)) {
221 lethal_state_update_min_x_ = std::min(*min_x, lethal_state_update_min_x_);
222 *min_x = lethal_state_update_min_x_;
223 lethal_state_update_min_y_ = std::min(*min_y, lethal_state_update_min_y_);
224 *min_y = lethal_state_update_min_y_;
225 lethal_state_update_max_x_ = std::max(*max_x, lethal_state_update_max_x_);
226 *max_x = lethal_state_update_max_x_;
227 lethal_state_update_max_y_ = std::max(*max_y, lethal_state_update_max_y_);
228 *max_y = lethal_state_update_max_y_;
231 lethal_state_update_min_x_ = std::numeric_limits<double>::max();
232 lethal_state_update_min_y_ = std::numeric_limits<double>::max();
233 lethal_state_update_max_x_ = std::numeric_limits<double>::lowest();
234 lethal_state_update_max_y_ = std::numeric_limits<double>::lowest();
241 int min_i,
int min_j,
int max_i,
int max_j,
242 const geometry_msgs::msg::Pose & )
244 std::lock_guard<CostmapFilter::mutex_t> guard(*
getMutex());
248 RCLCPP_WARN_THROTTLE(
249 logger_, *(clock_), 2000,
250 "KeepoutFilter: Filter mask was not received");
254 tf2::Transform tf2_transform;
255 tf2_transform.setIdentity();
256 int mg_min_x, mg_min_y;
257 int mg_max_x, mg_max_y;
259 const std::string mask_frame = filter_mask_->header.frame_id;
261 if (mask_frame != global_frame_) {
264 geometry_msgs::msg::TransformStamped transform;
266 transform = tf_->lookupTransform(
267 mask_frame, global_frame_, tf2::TimePointZero,
269 }
catch (tf2::TransformException & ex) {
272 "KeepoutFilter: Failed to get costmap frame (%s) "
273 "transformation to mask frame (%s) with error: %s",
274 global_frame_.c_str(), mask_frame.c_str(), ex.what());
277 tf2::fromMsg(transform.transform, tf2_transform);
308 const double half_cell_size = 0.5 * filter_mask_->info.resolution;
309 wx = filter_mask_->info.origin.position.x + half_cell_size;
310 wy = filter_mask_->info.origin.position.y + half_cell_size;
313 if (mg_min_x >= max_i || mg_min_y >= max_j) {
317 mg_min_x = std::max(min_i, mg_min_x);
318 mg_min_y = std::max(min_j, mg_min_y);
322 wx = filter_mask_->info.origin.position.x +
323 filter_mask_->info.width * filter_mask_->info.resolution + half_cell_size;
324 wy = filter_mask_->info.origin.position.y +
325 filter_mask_->info.height * filter_mask_->info.resolution + half_cell_size;
328 if (mg_max_x <= min_i || mg_max_y <= min_j) {
332 mg_max_x = std::min(max_i, mg_max_x);
333 mg_max_y = std::min(max_j, mg_max_y);
337 const unsigned int mg_min_x_u =
static_cast<unsigned int>(mg_min_x);
338 const unsigned int mg_min_y_u =
static_cast<unsigned int>(mg_min_y);
339 const unsigned int mg_max_x_u =
static_cast<unsigned int>(mg_max_x);
340 const unsigned int mg_max_y_u =
static_cast<unsigned int>(mg_max_y);
345 double msk_wx, msk_wy;
347 unsigned char data, old_data;
351 unsigned char * master_array = master_grid.
getCharMap();
352 for (i = mg_min_x_u; i < mg_max_x_u; i++) {
353 for (j = mg_min_y_u; j < mg_max_y_u; j++) {
355 old_data = master_array[index];
359 if (mask_frame != global_frame_) {
361 tf2::Vector3 point(gl_wx, gl_wy, 0);
362 point = tf2_transform * point;
371 if (nav2_util::worldToMap(filter_mask_, msk_wx, msk_wy, mx, my)) {
374 if (data == NO_INFORMATION) {
378 if (data > old_data || old_data == NO_INFORMATION) {
379 if (override_lethal_cost_ && is_pose_lethal_) {
380 master_array[index] = lethal_override_cost_;
382 master_array[index] = data;
389 last_pose_lethal_ = is_pose_lethal_;
394 std::lock_guard<CostmapFilter::mutex_t> guard(*
getMutex());
396 filter_info_sub_.reset();
402 std::lock_guard<CostmapFilter::mutex_t> guard(*
getMutex());
412 #include "pluginlib/class_list_macros.hpp"
A QoS profile for latched, reliable topics with a history of 10 messages.
A 2D costmap provides a mapping between points in the world and their associated "costs".
void mapToWorld(unsigned int mx, unsigned int my, double &wx, double &wy) const
Convert from map coordinates to world coordinates.
unsigned int getIndex(unsigned int mx, unsigned int my) const
Given two map coordinates... compute the associated index.
unsigned char * getCharMap() const
Will return a pointer to the underlying unsigned char array used as the costmap.
void worldToMapNoBounds(double wx, double wy, int &mx, int &my) const
Convert from world coordinates to map coordinates without checking for legal bounds.
bool transformPose(const std::string global_frame, const geometry_msgs::msg::Pose &global_pose, const std::string mask_frame, geometry_msgs::msg::Pose &mask_pose) const
: Transforms robot pose from current layer frame to mask frame
std::string filter_info_topic_
: Name of costmap filter info topic
std::string mask_topic_
: Name of filter mask topic
tf2::Duration transform_tolerance_
: mask_frame->global_frame_ transform tolerance
unsigned char getMaskCost(nav_msgs::msg::OccupancyGrid::ConstSharedPtr filter_mask, const unsigned int mx, const unsigned int &my) const
Get the cost of a cell in the filter mask.
mutex_t * getMutex()
: returns pointer to a mutex
void updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y) override
Update the bounds of the master costmap by this layer's update dimensions.
Reads in a keepout mask and marks keepout regions in the map to prevent planning or control in restri...
void process(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j, const geometry_msgs::msg::Pose &pose)
Process the keepout layer at the current pose / bounds / grid.
KeepoutFilter()
A constructor.
void resetFilter()
Reset the costmap filter / topic / info.
void initializeFilter(const std::string &filter_info_topic)
Initialize the filter and subscribe to the info topic.
bool isActive()
If this filter is active.
void updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y) override
Update the bounds of the master costmap by this layer's update dimensions.
Abstract class for layered costmap plugin implementations.
std::string joinWithParentNamespace(const std::string &topic)
void declareParameter(const std::string ¶m_name, const rclcpp::ParameterValue &value)
Convenience functions for declaring ROS parameters.
Costmap2D * getCostmap()
Get the costmap pointer to the master costmap.