|
Easy Navigation
|
ROS 2 lifecycle node that manages path planning in Easy Navigation. More...
#include <PlannerNode.hpp>


Public Types | |
| using | CallbackReturnT = rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn |
Public Member Functions | |
| void | cycle (std::shared_ptr< NavState > nav_state, bool trigger=false) |
| Execute a non-real-time cycle. | |
| const rclcpp::Time | get_last_execution_ts () const |
| Get the timestamp of the last non-RT execution. | |
| const rclcpp::Time | get_last_rt_execution_ts () const |
| Get the timestamp of the last real-time execution. | |
| nav_msgs::msg::Path | get_path () const |
| Get the current planned path. | |
| CallbackReturnT | on_activate (const rclcpp_lifecycle::State &state) |
| Activate the node. | |
| CallbackReturnT | on_cleanup (const rclcpp_lifecycle::State &state) |
| Clean up the node. | |
| CallbackReturnT | on_configure (const rclcpp_lifecycle::State &state) |
| Configure the node. | |
| CallbackReturnT | on_deactivate (const rclcpp_lifecycle::State &state) |
| Deactivate the node. | |
| CallbackReturnT | on_error (const rclcpp_lifecycle::State &state) |
| Handle lifecycle transition errors. | |
| CallbackReturnT | on_shutdown (const rclcpp_lifecycle::State &state) |
| Shutdown the node. | |
| PlannerNode (const rclcpp::NodeOptions &options=rclcpp::NodeOptions()) | |
| Constructor. | |
| ~PlannerNode () | |
| Destructor. | |
ROS 2 lifecycle node that manages path planning in Easy Navigation.
Handles lifecycle transitions, plugin loading, and invokes the planner to compute paths.
| using CallbackReturnT = rclcpp_lifecycle::node_interfaces::LifecycleNodeInterface::CallbackReturn |
|
explicit |
Constructor.
| options | Optional node configuration. |
| ~PlannerNode | ( | ) |
Destructor.
| void cycle | ( | std::shared_ptr< NavState > | nav_state, |
| bool | trigger = false ) |
Execute a non-real-time cycle.
| nav_state | Shared pointer to the navigation state structure. |
| trigger | If tru, a cycle is executed independently of the frequency set |
| const rclcpp::Time get_last_execution_ts | ( | ) | const |
Get the timestamp of the last non-RT execution.
| const rclcpp::Time get_last_rt_execution_ts | ( | ) | const |
Get the timestamp of the last real-time execution.
|
nodiscard |
Get the current planned path.
| CallbackReturnT on_activate | ( | const rclcpp_lifecycle::State & | state | ) |
Activate the node.
| state | Current lifecycle state. |
| CallbackReturnT on_cleanup | ( | const rclcpp_lifecycle::State & | state | ) |
Clean up the node.
| state | Current lifecycle state. |
| CallbackReturnT on_configure | ( | const rclcpp_lifecycle::State & | state | ) |
Configure the node.
| state | Current lifecycle state. |
| CallbackReturnT on_deactivate | ( | const rclcpp_lifecycle::State & | state | ) |
Deactivate the node.
| state | Current lifecycle state. |
| CallbackReturnT on_error | ( | const rclcpp_lifecycle::State & | state | ) |
Handle lifecycle transition errors.
| state | Current lifecycle state. |
| CallbackReturnT on_shutdown | ( | const rclcpp_lifecycle::State & | state | ) |
Shutdown the node.
| state | Current lifecycle state. |