Classes | |
class | DoubleThreadLocomotor |
Connect the callbacks in Locomotor to do global and local planning on two separate timers. More... | |
class | Executor |
Collection of objects used in ROS CallbackQueue threading. More... | |
class | Locomotor |
an extensible path planning coordination engine More... | |
class | LocomotorActionServer |
class | LocomotorCallback |
Extension of ros::CallbackInterface so we can insert things on the ROS Callback Queue. More... | |
class | PathPublisher |
class | SingleThreadLocomotor |
Connect the callbacks in Locomotor to do global planning once and then local planning on a timer. More... | |
class | TwistPublisher |
Typedefs | |
using | CostmapUpdateCallback = std::function< void(const ros::Duration &)> |
using | CostmapUpdateExceptionCallback = std::function< void(nav_core2::NavCore2ExceptionPtr, const ros::Duration &)> |
using | GlobalPlanCallback = std::function< void(const nav_2d_msgs::Path2D &, const ros::Duration &)> |
using | LocalPlanCallback = std::function< void(const nav_2d_msgs::Twist2DStamped &, const ros::Duration &)> |
using | NavigationCompleteCallback = std::function< void()> |
using | NavigationFailureCallback = std::function< void(const locomotor_msgs::ResultCode)> |
using | NewGoalCallback = std::function< void(const nav_2d_msgs::Pose2DStamped &)> |
using | PlannerExceptionCallback = std::function< void(nav_core2::NavCore2ExceptionPtr, const ros::Duration &)> |
Enumerations | |
enum | PathType { PathType::NO_PATH, PathType::PATH_3D, PathType::PATH_2D } |
enum | TwistType { TwistType::NO_TWIST, TwistType::TWIST_3D, TwistType::TWIST_2D, TwistType::TWIST_2D_STAMPED } |
Functions | |
ros::Duration | getTimeDiffFromNow (const ros::WallTime &start_time) |
locomotor_msgs::ResultCode | makeResultCode (int component=-1, int result_code=-1, const std::string &message="") |
using locomotor::CostmapUpdateCallback = typedef std::function<void (const ros::Duration&)> |
Definition at line 58 of file locomotor.h.
using locomotor::CostmapUpdateExceptionCallback = typedef std::function<void (nav_core2::NavCore2ExceptionPtr, const ros::Duration&)> |
Definition at line 59 of file locomotor.h.
using locomotor::GlobalPlanCallback = typedef std::function<void (const nav_2d_msgs::Path2D&, const ros::Duration&)> |
Definition at line 60 of file locomotor.h.
using locomotor::LocalPlanCallback = typedef std::function<void (const nav_2d_msgs::Twist2DStamped&, const ros::Duration&)> |
Definition at line 61 of file locomotor.h.
using locomotor::NavigationCompleteCallback = typedef std::function<void ()> |
Definition at line 63 of file locomotor.h.
using locomotor::NavigationFailureCallback = typedef std::function<void (const locomotor_msgs::ResultCode)> |
Definition at line 64 of file locomotor.h.
using locomotor::NewGoalCallback = typedef std::function<void (const nav_2d_msgs::Pose2DStamped&)> |
Definition at line 45 of file locomotor_action_server.h.
using locomotor::PlannerExceptionCallback = typedef std::function<void (nav_core2::NavCore2ExceptionPtr, const ros::Duration&)> |
Definition at line 62 of file locomotor.h.
|
strong |
Enumerator | |
---|---|
NO_PATH | |
PATH_3D | |
PATH_2D |
Definition at line 44 of file publishers.h.
|
strong |
Enumerator | |
---|---|
NO_TWIST | |
TWIST_3D | |
TWIST_2D | |
TWIST_2D_STAMPED |
Definition at line 45 of file publishers.h.
ros::Duration locomotor::getTimeDiffFromNow | ( | const ros::WallTime & | start_time | ) |
Definition at line 43 of file locomotor.cpp.
|
inline |
Definition at line 66 of file locomotor.h.