File tree Expand file tree Collapse file tree 2 files changed +0
-16
lines changed Expand file tree Collapse file tree 2 files changed +0
-16
lines changed Original file line number Diff line number Diff line change @@ -56,10 +56,6 @@ class CostmapSubscriber
56
56
* @brief Get current costmap
57
57
*/
58
58
std::shared_ptr<Costmap2D> getCostmap ();
59
- /* *
60
- * @brief Get the timestamp of the last costmap update
61
- */
62
- rclcpp::Time getTimestampLastCostmapUpdate ();
63
59
/* *
64
60
* @brief Callback for the costmap topic
65
61
*/
Original file line number Diff line number Diff line change @@ -68,18 +68,6 @@ std::shared_ptr<Costmap2D> CostmapSubscriber::getCostmap()
68
68
return costmap_;
69
69
}
70
70
71
- rclcpp::Time CostmapSubscriber::getTimestampLastCostmapUpdate ()
72
- {
73
- if (!isCostmapReceived ()) {
74
- throw std::runtime_error (" Costmap is not available" );
75
- }
76
-
77
- std::lock_guard<std::mutex> lock (costmap_msg_mutex_);
78
- auto stamp = costmap_msg_->header .stamp ;
79
-
80
- return stamp;
81
- }
82
-
83
71
void CostmapSubscriber::costmapCallback (const nav2_msgs::msg::Costmap::SharedPtr msg)
84
72
{
85
73
{
You can’t perform that action at this time.
0 commit comments