Classes | |
class | AStarExpansion |
class | DijkstraExpansion |
class | Expander |
class | GlobalPlanner |
class | GradientPath |
struct | greater1 |
class | GridPath |
class | Index |
class | OrientationFilter |
class | PlannerWithCostmap |
class | PotentialCalculator |
class | QuadraticCalculator |
class | Traceback |
Enumerations | |
enum | OrientationMode { NONE, FORWARD, INTERPOLATE, FORWARDTHENINTERPOLATE } |
Functions | |
double | getYaw (geometry_msgs::PoseStamped pose) |
void | set_angle (geometry_msgs::PoseStamped *pose, double angle) |
Definition at line 43 of file orientation_filter.h.
double global_planner::getYaw | ( | geometry_msgs::PoseStamped | pose | ) |
Definition at line 48 of file orientation_filter.cpp.
void global_planner::set_angle | ( | geometry_msgs::PoseStamped * | pose, |
double | angle | ||
) |
Definition at line 43 of file orientation_filter.cpp.