Namespaces | Functions
geometry_tools.h File Reference
#include <geometry_msgs/Polygon.h>
#include <geometry_msgs/Point.h>
#include <costmap_2d/costmap_2d.h>
Include dependency graph for geometry_tools.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  heatmap

Functions

template<typename T >
T heatmap::bottomLeftPointPolygon (const geometry_msgs::Polygon &polygon)
 Calculate the point with minimal x, y coordinates of all polygon points.
template<typename T >
std::vector< Theatmap::fillPolygon (const geometry_msgs::Polygon &polygon, const double spacing)
 Fill a polygon with points known the spacing between them.
template<typename T >
bool heatmap::pointInPolygon (const T &point, const geometry_msgs::Polygon &polygon)
 Evaluate if point is inside area defined by polygon. Undefined behaviour for points on line.
template<typename T , typename S >
double heatmap::pointsDistance (const T &one, const S &two)
 Calculate distance between two points.
template<typename T , typename S >
bool heatmap::pointsNearby (const T &one, const S &two, const double &proximity)
 Evaluate whether two points are approximately adjacent, within a specified proximity distance.
double heatmap::polygonPerimeter (const geometry_msgs::Polygon &polygon)
 Calculate polygon perimeter.
template<typename T , typename S >
std::vector< double > heatmap::shepardInterpolation (const std::vector< T > interpolation_points, const std::vector< T > data_points, const std::vector< S > data, const double shepard_power)
 Interpolate a known scattered data set using the Shepard (aka inverse distance weighting) interpolation.
template<typename T >
T heatmap::topRightPointPolygon (const geometry_msgs::Polygon &polygon)
 Calculate the point with maximal x, y coordinates of all polygon points.
template<typename T , typename S >
double heatmap::yawOfVector (const T &origin, const S &end)
 Calculate the yaw of vector defined by origin and end points.


heatmap
Author(s): Adrian Bauer
autogenerated on Thu Feb 11 2016 23:05:26