#include <math.h>#include <stdint.h>#include <string.h>#include <stdio.h>#include <vector>#include <tf/transform_datatypes.h>#include <geometry_msgs/PoseStamped.h>#include <Eigen/Dense>#include <Eigen/Geometry>#include <Eigen/StdVector>#include <Eigen/Core>#include <iostream>

Go to the source code of this file.
Classes | |
| class | iri_bspline_navfn::NavFn |
| Navigation function class. Holds buffers for costmap, navfn map. Maps are pixel-based. Origin is upper left, x is right, y is down. More... | |
Namespaces | |
| namespace | iri_bspline_navfn |
Defines | |
| #define | COST_FACTOR 3 |
| #define | COST_NEUTRAL 50 |
| #define | COST_OBS 254 |
| #define | COST_OBS_ROS 253 |
| #define | COST_UNKNOWN_ROS 255 |
| #define | COSTTYPE unsigned char |
| #define | POT_HIGH 1.0e10 |
| #define | PRIORITYBUFSIZE 10000 |
Functions | |
| int | iri_bspline_navfn::create_nav_plan_astar (const COSTTYPE *costmap, int nx, int ny, int *goal, int *start, float *plan, int nplan) |
| #define COST_FACTOR 3 |
| #define COST_NEUTRAL 50 |
| #define COST_OBS_ROS 253 |
| #define COST_UNKNOWN_ROS 255 |
| #define PRIORITYBUFSIZE 10000 |