Nav2 Navigation Stack - jazzy  jazzy
ROS 2 Navigation Stack
Public Member Functions | List of all members
nav2_system_tests::NavFnPlannerTester Class Reference
Inheritance diagram for nav2_system_tests::NavFnPlannerTester:
Inheritance graph
[legend]
Collaboration diagram for nav2_system_tests::NavFnPlannerTester:
Collaboration graph
[legend]

Public Member Functions

void printCostmap ()
 
void setCostmap (nav2_util::Costmap *costmap)
 
bool createPath (const geometry_msgs::msg::PoseStamped &goal, nav_msgs::msg::Path &path)
 
void onCleanup (const rclcpp_lifecycle::State &state)
 
void onActivate (const rclcpp_lifecycle::State &state)
 
void onDeactivate (const rclcpp_lifecycle::State &state)
 
void onConfigure (const rclcpp_lifecycle::State &state)
 
- Public Member Functions inherited from nav2_planner::PlannerServer
 PlannerServer (const rclcpp::NodeOptions &options=rclcpp::NodeOptions())
 A constructor for nav2_planner::PlannerServer. More...
 
 ~PlannerServer ()
 A destructor for nav2_planner::PlannerServer.
 
nav_msgs::msg::Path getPlan (const geometry_msgs::msg::PoseStamped &start, const geometry_msgs::msg::PoseStamped &goal, const std::string &planner_id, std::function< bool()> cancel_checker)
 Method to get plan from the desired plugin. More...
 
- Public Member Functions inherited from nav2_util::LifecycleNode
 LifecycleNode (const std::string &node_name, const std::string &ns="", const rclcpp::NodeOptions &options=rclcpp::NodeOptions())
 A lifecycle node constructor. More...
 
void add_parameter (const std::string &name, const rclcpp::ParameterValue &default_value, const std::string &description="", const std::string &additional_constraints="", bool read_only=false)
 Declare a parameter that has no integer or floating point range constraints. More...
 
void add_parameter (const std::string &name, const rclcpp::ParameterValue &default_value, const floating_point_range fp_range, const std::string &description="", const std::string &additional_constraints="", bool read_only=false)
 Declare a parameter that has a floating point range constraint. More...
 
void add_parameter (const std::string &name, const rclcpp::ParameterValue &default_value, const integer_range int_range, const std::string &description="", const std::string &additional_constraints="", bool read_only=false)
 Declare a parameter that has an integer range constraint. More...
 
std::shared_ptr< nav2_util::LifecycleNodeshared_from_this ()
 Get a shared pointer of this.
 
nav2_util::CallbackReturn on_error (const rclcpp_lifecycle::State &)
 Abstracted on_error state transition callback, since unimplemented as of 2020 in the managed ROS2 node state machine. More...
 
void autostart ()
 Automatically configure and active the node.
 
virtual void on_rcl_preshutdown ()
 Perform preshutdown activities before our Context is shutdown. Note that this is related to our Context's shutdown sequence, not the lifecycle node state machine.
 
void createBond ()
 Create bond connection to lifecycle manager.
 
void destroyBond ()
 Destroy bond connection to lifecycle manager.
 

Additional Inherited Members

- Public Types inherited from nav2_planner::PlannerServer
using PlannerMap = std::unordered_map< std::string, nav2_core::GlobalPlanner::Ptr >
 
- Protected Types inherited from nav2_planner::PlannerServer
using ActionToPose = nav2_msgs::action::ComputePathToPose
 
using ActionToPoseResult = ActionToPose::Result
 
using ActionThroughPoses = nav2_msgs::action::ComputePathThroughPoses
 
using ActionThroughPosesResult = ActionThroughPoses::Result
 
using ActionServerToPose = nav2_util::SimpleActionServer< ActionToPose >
 
using ActionServerThroughPoses = nav2_util::SimpleActionServer< ActionThroughPoses >
 
- Protected Member Functions inherited from nav2_planner::PlannerServer
nav2_util::CallbackReturn on_configure (const rclcpp_lifecycle::State &state) override
 Configure member variables and initializes planner. More...
 
nav2_util::CallbackReturn on_activate (const rclcpp_lifecycle::State &state) override
 Activate member variables. More...
 
nav2_util::CallbackReturn on_deactivate (const rclcpp_lifecycle::State &state) override
 Deactivate member variables. More...
 
nav2_util::CallbackReturn on_cleanup (const rclcpp_lifecycle::State &state) override
 Reset member variables. More...
 
nav2_util::CallbackReturn on_shutdown (const rclcpp_lifecycle::State &state) override
 Called when in shutdown state. More...
 
template<typename T >
bool isServerInactive (std::unique_ptr< nav2_util::SimpleActionServer< T >> &action_server)
 Check if an action server is valid / active. More...
 
template<typename T >
bool isCancelRequested (std::unique_ptr< nav2_util::SimpleActionServer< T >> &action_server)
 Check if an action server has a cancellation request pending. More...
 
void waitForCostmap ()
 Wait for costmap to be valid with updated sensor data or repopulate after a clearing recovery. Blocks until true without timeout.
 
template<typename T >
void getPreemptedGoalIfRequested (std::unique_ptr< nav2_util::SimpleActionServer< T >> &action_server, typename std::shared_ptr< const typename T::Goal > goal)
 Check if an action server has a preemption request and replaces the goal with the new preemption goal. More...
 
template<typename T >
bool getStartPose (typename std::shared_ptr< const typename T::Goal > goal, geometry_msgs::msg::PoseStamped &start)
 Get the starting pose from costmap or message, if valid. More...
 
bool transformPosesToGlobalFrame (geometry_msgs::msg::PoseStamped &curr_start, geometry_msgs::msg::PoseStamped &curr_goal)
 Transform start and goal poses into the costmap global frame for path planning plugins to utilize. More...
 
template<typename T >
bool validatePath (const geometry_msgs::msg::PoseStamped &curr_goal, const nav_msgs::msg::Path &path, const std::string &planner_id)
 Validate that the path contains a meaningful path. More...
 
void computePlan ()
 The action server callback which calls planner to get the path ComputePathToPose.
 
void computePlanThroughPoses ()
 The action server callback which calls planner to get the path ComputePathThroughPoses.
 
void isPathValid (const std::shared_ptr< nav2_msgs::srv::IsPathValid::Request > request, std::shared_ptr< nav2_msgs::srv::IsPathValid::Response > response)
 The service callback to determine if the path is still valid. More...
 
void publishPlan (const nav_msgs::msg::Path &path)
 Publish a path for visualization purposes. More...
 
void exceptionWarning (const geometry_msgs::msg::PoseStamped &start, const geometry_msgs::msg::PoseStamped &goal, const std::string &planner_id, const std::exception &ex)
 
rcl_interfaces::msg::SetParametersResult dynamicParametersCallback (std::vector< rclcpp::Parameter > parameters)
 Callback executed when a parameter change is detected. More...
 
- Protected Member Functions inherited from nav2_util::LifecycleNode
void printLifecycleNodeNotification ()
 Print notifications for lifecycle node.
 
void register_rcl_preshutdown_callback ()
 
void runCleanups ()
 
- Protected Attributes inherited from nav2_planner::PlannerServer
std::unique_ptr< ActionServerToPoseaction_server_pose_
 
std::unique_ptr< ActionServerThroughPosesaction_server_poses_
 
rclcpp::node_interfaces::OnSetParametersCallbackHandle::SharedPtr dyn_params_handler_
 
std::mutex dynamic_params_lock_
 
PlannerMap planners_
 
pluginlib::ClassLoader< nav2_core::GlobalPlannergp_loader_
 
std::vector< std::string > default_ids_
 
std::vector< std::string > default_types_
 
std::vector< std::string > planner_ids_
 
std::vector< std::string > planner_types_
 
double max_planner_duration_
 
rclcpp::Duration costmap_update_timeout_
 
std::string planner_ids_concat_
 
std::shared_ptr< tf2_ros::Buffer > tf_
 
std::shared_ptr< nav2_costmap_2d::Costmap2DROScostmap_ros_
 
std::unique_ptr< nav2_util::NodeThreadcostmap_thread_
 
nav2_costmap_2d::Costmap2Dcostmap_
 
std::unique_ptr< nav2_costmap_2d::FootprintCollisionChecker< nav2_costmap_2d::Costmap2D * > > collision_checker_
 
rclcpp_lifecycle::LifecyclePublisher< nav_msgs::msg::Path >::SharedPtr plan_publisher_
 
rclcpp::Service< nav2_msgs::srv::IsPathValid >::SharedPtr is_path_valid_service_
 
- Protected Attributes inherited from nav2_util::LifecycleNode
std::unique_ptr< rclcpp::PreShutdownCallbackHandle > rcl_preshutdown_cb_handle_ {nullptr}
 
std::unique_ptr< bond::Bond > bond_ {nullptr}
 
double bond_heartbeat_period
 
rclcpp::TimerBase::SharedPtr autostart_timer_
 

Detailed Description

Definition at line 43 of file planner_tester.hpp.


The documentation for this class was generated from the following file: