Classes | |
class | AvoidanceResolution |
class | BacktrackingResolution |
class | Checkpoint |
class | CollisionResolution |
class | EmptyResolution |
class | Heuristic |
class | MultiRobotRouter |
standard multi robot router without multi threading (Works best in practice) More... | |
class | MultiRobotRouterThreadedSrr |
class | PointExpander |
class | PotentialCalculator |
class | PriorityScheduler |
struct | Robot |
class | RobotInfo |
class | RouteCoordinator |
class | RouteCoordinatorTimed |
class | RouteCoordinatorWrapper |
class | RouteGenerator |
class | Router |
class | Router_Node |
class | RouteVertex |
class | Segment |
class | SegmentExpander |
class | SingleRobotRouter |
class | SpeedScheduler |
class | Traceback |
class | Vertex |
Typedefs | |
typedef struct multi_robot_router::Robot | Robot |
typedef std::shared_ptr< RobotInfo > | RobotInfoPtr |
typedef std::vector< std::shared_ptr< RobotInfo > >::iterator | RobotInfoPtrIterator |
Functions | |
geometry_msgs::Pose & | copy (const Eigen::Vector3d &src, geometry_msgs::Pose &des) |
geometry_msgs::Pose | copy (const Eigen::Vector3d &src) |
Eigen::Vector3d & | copy (const geometry_msgs::Pose &src, Eigen::Vector3d &des) |
Eigen::Vector3d | copy (const geometry_msgs::Pose &src) |
typedef struct multi_robot_router::Robot multi_robot_router::Robot |
typedef std::shared_ptr<RobotInfo> multi_robot_router::RobotInfoPtr |
Definition at line 123 of file robot_info.h.
typedef std::vector<std::shared_ptr<RobotInfo> >::iterator multi_robot_router::RobotInfoPtrIterator |
Definition at line 124 of file robot_info.h.
|
inline |
Definition at line 13 of file mrr_utils.h.
|
inline |
Definition at line 24 of file mrr_utils.h.
|
inline |
Definition at line 29 of file mrr_utils.h.
|
inline |
Definition at line 36 of file mrr_utils.h.