Go to the documentation of this file.
104 "Global Costmap failure."));
119 "Global Planning Failure."));
140 "Local Costmap failure."));
148 ROS_WARN_NAMED(
"locomotor",
"Control loop missed its desired rate of %.4fHz... "
149 "the loop actually took %.4f seconds (>%.4f).",
157 ROS_WARN_NAMED(
"Locomotor",
"Local planning error. Creating new global plan.");
192 int main(
int argc,
char** argv)
void failNavigation(const locomotor_msgs::ResultCode &result_code)
void initializeLocalPlanners(Executor &ex)
LocomotorActionServer as_
void onLocalCostmapException(nav_core2::NavCore2ExceptionPtr e_ptr, const ros::Duration &planning_time)
void onGlobalCostmapException(nav_core2::NavCore2ExceptionPtr e_ptr, const ros::Duration &planning_time)
void onNavigationFailure(const locomotor_msgs::ResultCode result)
Collection of objects used in ROS CallbackQueue threading.
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
void requestLocalPlan(Executor &work_ex, Executor &result_ex, LocalPlanCallback cb=nullptr, PlannerExceptionCallback fail_cb=nullptr, NavigationCompleteCallback complete_cb=nullptr)
Request the local planner get run as a new callback.
void initializeGlobalPlanners(Executor &ex)
void publishFeedback(const locomotor_msgs::NavigationState &nav_state)
virtual void setGoal(nav_2d_msgs::Pose2DStamped goal)
Starts a new navigation to the given goal.
void onNewGlobalPlan(nav_2d_msgs::Path2D new_global_plan, const ros::Duration &planning_time)
void requestLocalCostmapUpdate(Executor &work_ex, Executor &result_ex, CostmapUpdateCallback cb=nullptr, CostmapUpdateExceptionCallback fail_cb=nullptr)
Request the local costmap get updated as a new callback.
void setGoal(nav_2d_msgs::Pose2DStamped goal)
void onLocalCostmapUpdate(const ros::Duration &planning_time)
void onNavigationCompleted()
an extensible path planning coordination engine
ros::Timer control_loop_timer_
#define ROS_ERROR_NAMED(name,...)
void initializeLocalCostmap(Executor &ex)
void initializeGlobalCostmap(Executor &ex)
std::exception_ptr NavCore2ExceptionPtr
void publishTwist(const nav_2d_msgs::Twist2DStamped &command)
int getResultCode(const NavCore2ExceptionPtr &e_ptr)
Connect the callbacks in Locomotor to do global planning once and then local planning on a timer.
SingleThreadLocomotor(const ros::NodeHandle &private_nh)
#define ROS_INFO_NAMED(name,...)
void controlLoopCallback(const ros::TimerEvent &event)
void completeNavigation()
void publishPath(const nav_2d_msgs::Path2D &global_plan)
virtual void setPlan(const nav_2d_msgs::Path2D &path)=0
ros::NodeHandle private_nh_
double controller_frequency_
void requestNavigationFailure(Executor &result_ex, const locomotor_msgs::ResultCode &result, NavigationFailureCallback cb=nullptr)
Request that a onNavigationFailure event be added as a new callback.
void onGlobalCostmapUpdate(const ros::Duration &planning_time)
nav_core2::LocalPlanner & getCurrentLocalPlanner()
void requestGlobalCostmapUpdate()
void onNewLocalPlan(nav_2d_msgs::Twist2DStamped new_command, const ros::Duration &planning_time)
void onGlobalPlanningException(nav_core2::NavCore2ExceptionPtr e_ptr, const ros::Duration &planning_time)
void requestNavigationFailure(const locomotor_msgs::ResultCode &result)
void requestGlobalCostmapUpdate(Executor &work_ex, Executor &result_ex, CostmapUpdateCallback cb=nullptr, CostmapUpdateExceptionCallback fail_cb=nullptr)
Request the global costmap get updated as a new callback.
#define ROS_WARN_NAMED(name,...)
T param(const std::string ¶m_name, const T &default_val) const
int main(int argc, char **argv)
const locomotor_msgs::NavigationState & getNavigationState() const
void onLocalPlanningException(nav_core2::NavCore2ExceptionPtr e_ptr, const ros::Duration &planning_time)
Timer createTimer(Duration period, const TimerCallback &callback, bool oneshot=false, bool autostart=true) const
locomotor_msgs::ResultCode makeResultCode(int component=-1, int result_code=-1, const std::string &message="")
void requestGlobalPlan(Executor &work_ex, Executor &result_ex, GlobalPlanCallback cb=nullptr, PlannerExceptionCallback fail_cb=nullptr)
Request the global planner get run as a new callback.
ros::Duration desired_control_duration_
locomotor
Author(s):
autogenerated on Sun May 18 2025 02:47:30