38 #ifndef NAV2_COSTMAP_2D__COSTMAP_2D_ROS_HPP_
39 #define NAV2_COSTMAP_2D__COSTMAP_2D_ROS_HPP_
46 #include "geometry_msgs/msg/polygon.h"
47 #include "geometry_msgs/msg/polygon_stamped.h"
48 #include "nav2_costmap_2d/costmap_2d_publisher.hpp"
49 #include "nav2_costmap_2d/footprint.hpp"
50 #include "nav2_costmap_2d/footprint_collision_checker.hpp"
51 #include "nav2_costmap_2d/clear_costmap_service.hpp"
52 #include "nav2_costmap_2d/layered_costmap.hpp"
53 #include "nav2_costmap_2d/layer.hpp"
54 #include "nav2_util/lifecycle_node.hpp"
55 #include "nav2_msgs/srv/get_cost.hpp"
56 #include "pluginlib/class_loader.hpp"
57 #include "tf2/convert.h"
58 #include "tf2/LinearMath/Transform.h"
59 #include "tf2_ros/buffer.h"
60 #include "tf2_ros/transform_listener.h"
62 #include "tf2/transform_datatypes.h"
64 #pragma GCC diagnostic push
65 #pragma GCC diagnostic ignored "-Wpedantic"
66 #include "tf2/utils.h"
67 #pragma GCC diagnostic pop
82 explicit Costmap2DROS(
const rclcpp::NodeOptions & options = rclcpp::NodeOptions());
90 explicit Costmap2DROS(
const std::string & name,
const bool & use_sim_time =
false);
100 const std::string & name,
101 const std::string & parent_namespace,
102 const std::string & local_namespace,
103 const bool & use_sim_time);
118 nav2_util::CallbackReturn
on_configure(
const rclcpp_lifecycle::State & state)
override;
123 nav2_util::CallbackReturn
on_activate(
const rclcpp_lifecycle::State & state)
override;
128 nav2_util::CallbackReturn
on_deactivate(
const rclcpp_lifecycle::State & state)
override;
133 nav2_util::CallbackReturn
on_cleanup(
const rclcpp_lifecycle::State & state)
override;
138 nav2_util::CallbackReturn
on_shutdown(
const rclcpp_lifecycle::State & state)
override;
154 get_logger(),
"Running Nav2 LifecycleNode rcl preshutdown (%s)",
197 return layered_costmap_->isCurrent();
205 bool getRobotPose(geometry_msgs::msg::PoseStamped & global_pose);
214 const geometry_msgs::msg::PoseStamped & input_pose,
215 geometry_msgs::msg::PoseStamped & transformed_pose);
236 return layered_costmap_->getCostmap();
262 return layered_costmap_.get();
281 return padded_footprint_;
293 return unpadded_footprint_;
326 std::shared_ptr<tf2_ros::Buffer> getTfBuffer() {
return tf_buffer_;}
349 const std::shared_ptr<rmw_request_id_t>,
350 const std::shared_ptr<nav2_msgs::srv::GetCost::Request> request,
351 const std::shared_ptr<nav2_msgs::srv::GetCost::Response> response);
355 rclcpp_lifecycle::LifecyclePublisher<geometry_msgs::msg::PolygonStamped>::SharedPtr
357 std::unique_ptr<Costmap2DPublisher> costmap_publisher_;
359 std::vector<std::unique_ptr<Costmap2DPublisher>> layer_publishers_;
361 rclcpp::Subscription<geometry_msgs::msg::Polygon>::SharedPtr footprint_sub_;
362 rclcpp::Subscription<rcl_interfaces::msg::ParameterEvent>::SharedPtr parameter_sub_;
365 rclcpp::CallbackGroup::SharedPtr callback_group_;
366 rclcpp::executors::SingleThreadedExecutor::SharedPtr executor_;
367 std::unique_ptr<nav2_util::NodeThread> executor_thread_;
370 std::shared_ptr<tf2_ros::Buffer> tf_buffer_;
371 std::shared_ptr<tf2_ros::TransformListener> tf_listener_;
373 std::unique_ptr<LayeredCostmap> layered_costmap_{
nullptr};
375 std::string parent_namespace_;
381 bool map_update_thread_shutdown_{
false};
382 std::atomic<bool> stop_updates_{
false};
383 std::atomic<bool> initialized_{
false};
384 std::atomic<bool> stopped_{
true};
385 std::mutex _dynamic_parameter_mutex;
387 rclcpp::Time last_publish_{0, 0, RCL_ROS_TIME};
388 rclcpp::Duration publish_cycle_{1, 0};
389 pluginlib::ClassLoader<Layer> plugin_loader_{
"nav2_costmap_2d",
"nav2_costmap_2d::Layer"};
395 bool always_send_full_costmap_{
false};
396 std::string footprint_;
397 float footprint_padding_{0};
399 int map_height_meters_{0};
400 double map_publish_frequency_{0};
401 double map_update_frequency_{0};
402 int map_width_meters_{0};
405 std::vector<std::string> default_plugins_;
406 std::vector<std::string> default_types_;
407 std::vector<std::string> plugin_names_;
408 std::vector<std::string> plugin_types_;
409 std::vector<std::string> filter_names_;
410 std::vector<std::string> filter_types_;
411 double resolution_{0};
413 double robot_radius_;
415 bool track_unknown_space_{
false};
423 bool use_radius_{
false};
424 std::vector<geometry_msgs::msg::Point> unpadded_footprint_;
425 std::vector<geometry_msgs::msg::Point> padded_footprint_;
428 rclcpp::Service<nav2_msgs::srv::GetCost>::SharedPtr get_cost_service_;
429 std::unique_ptr<ClearCostmapService> clear_costmap_service_;
432 OnSetParametersCallbackHandle::SharedPtr dyn_params_handler;
438 rcl_interfaces::msg::SetParametersResult
A ROS wrapper for a 2D Costmap. Handles subscribing to topics that provide observations about obstacl...
Costmap2DROS(const rclcpp::NodeOptions &options=rclcpp::NodeOptions())
Constructor for the wrapper.
void mapUpdateLoop(double frequency)
Function on timer for costmap update.
nav2_util::CallbackReturn on_activate(const rclcpp_lifecycle::State &state) override
Activate node.
void getOrientedFootprint(std::vector< geometry_msgs::msg::Point > &oriented_footprint)
Build the oriented footprint of the robot at the robot's current pose.
rcl_interfaces::msg::SetParametersResult dynamicParametersCallback(std::vector< rclcpp::Parameter > parameters)
Callback executed when a paramter change is detected.
bool getRobotPose(geometry_msgs::msg::PoseStamped &global_pose)
Get the pose of the robot in the global frame of the costmap.
void getParameters()
Get parameters for node.
geometry_msgs::msg::Polygon getRobotFootprintPolygon()
Returns the current padded footprint as a geometry_msgs::msg::Polygon.
void pause()
Stops the costmap from updating, but sensor data still comes in over the wire.
bool getUseRadius()
Get the costmap's use_radius_ parameter, corresponding to whether the footprint for the robot is a ci...
void setRobotFootprintPolygon(const geometry_msgs::msg::Polygon::SharedPtr footprint)
Set the footprint of the robot to be the given polygon, padded by footprint_padding.
nav2_util::CallbackReturn on_shutdown(const rclcpp_lifecycle::State &state) override
shutdown node
std::string getName() const
Returns costmap name.
~Costmap2DROS()
A destructor.
double transform_tolerance_
The timeout before transform errors.
bool rolling_window_
Whether to use a rolling window version of the costmap.
LayeredCostmap * getLayeredCostmap()
Get the layered costmap object used in the node.
void on_rcl_preshutdown() override
as a child-LifecycleNode : Costmap2DROS may be launched by another Lifecycle Node as a composed modul...
void resume()
Resumes costmap updates.
double map_vis_z_
The height of map, allows to avoid flickering at -0.008.
double initial_transform_timeout_
The timeout before activation of the node errors.
void updateMap()
Update the map with the layered costmap / plugins.
nav2_util::CallbackReturn on_deactivate(const rclcpp_lifecycle::State &state) override
Deactivate node.
std::string getBaseFrameID()
Returns the local frame of the costmap.
nav2_util::CallbackReturn on_configure(const rclcpp_lifecycle::State &state) override
Configure node.
std::vector< geometry_msgs::msg::Point > getRobotFootprint()
Return the current footprint of the robot as a vector of points.
void setRobotFootprint(const std::vector< geometry_msgs::msg::Point > &points)
Set the footprint of the robot to be the given set of points, padded by footprint_padding.
void resetLayers()
Reset each individual layer.
bool transformPoseToGlobalFrame(const geometry_msgs::msg::PoseStamped &input_pose, geometry_msgs::msg::PoseStamped &transformed_pose)
Transform the input_pose in the global frame of the costmap.
std::string global_frame_
The global frame for the costmap.
std::string getGlobalFrameID()
Returns the global frame of the costmap.
void getCostCallback(const std::shared_ptr< rmw_request_id_t >, const std::shared_ptr< nav2_msgs::srv::GetCost::Request > request, const std::shared_ptr< nav2_msgs::srv::GetCost::Response > response)
Get the cost at a point in costmap.
void start()
Subscribes to sensor topics if necessary and starts costmap updates, can be called to restart the cos...
void stop()
Stops costmap updates and unsubscribes from sensor topics.
std::string robot_base_frame_
The frame_id of the robot base.
bool isCurrent()
Same as getLayeredCostmap()->isCurrent().
double getTransformTolerance() const
Returns the delay in transform (tf) data that is tolerable in seconds.
nav2_util::CallbackReturn on_cleanup(const rclcpp_lifecycle::State &state) override
Cleanup node.
double getRobotRadius()
Get the costmap's robot_radius_ parameter, corresponding to raidus of the robot footprint when it is ...
std::unique_ptr< std::thread > map_update_thread_
A thread for updating the map.
Costmap2D * getCostmap()
Return a pointer to the "master" costmap which receives updates from all the layers.
void init()
Common initialization for constructors.
std::vector< geometry_msgs::msg::Point > getUnpaddedRobotFootprint()
Return the current unpadded footprint of the robot as a vector of points.
bool is_lifecycle_follower_
whether is a child-LifecycleNode or an independent node
A 2D costmap provides a mapping between points in the world and their associated "costs".
Instantiates different layer plugins and aggregates them into one score.
A lifecycle node wrapper to enable common Nav2 needs such as manipulating parameters.
void destroyBond()
Destroy bond connection to lifecycle manager.
geometry_msgs::msg::Polygon toPolygon(std::vector< geometry_msgs::msg::Point > pts)
Convert vector of Points to Polygon msg.