Functions
costmap_math.cpp File Reference
#include <costmap_2d/costmap_math.h>
Include dependency graph for costmap_math.cpp:

Go to the source code of this file.

Functions

double distanceToLine (double pX, double pY, double x0, double y0, double x1, double y1)
bool intersects (std::vector< geometry_msgs::Point > &polygon, float testx, float testy)
bool intersects (std::vector< geometry_msgs::Point > &polygon1, std::vector< geometry_msgs::Point > &polygon2)
bool intersects_helper (std::vector< geometry_msgs::Point > &polygon1, std::vector< geometry_msgs::Point > &polygon2)

Function Documentation

double distanceToLine ( double  pX,
double  pY,
double  x0,
double  y0,
double  x1,
double  y1 
)

Definition at line 32 of file costmap_math.cpp.

bool intersects ( std::vector< geometry_msgs::Point > &  polygon,
float  testx,
float  testy 
)

Definition at line 64 of file costmap_math.cpp.

bool intersects ( std::vector< geometry_msgs::Point > &  polygon1,
std::vector< geometry_msgs::Point > &  polygon2 
)

Definition at line 86 of file costmap_math.cpp.

bool intersects_helper ( std::vector< geometry_msgs::Point > &  polygon1,
std::vector< geometry_msgs::Point > &  polygon2 
)

Definition at line 78 of file costmap_math.cpp.



costmap_2d
Author(s): Eitan Marder-Eppstein, David V. Lu!!, Dave Hershberger, contradict@gmail.com
autogenerated on Thu Aug 27 2015 14:06:55