#include <angles/angles.h>#include <boost/foreach.hpp>#include <boost/tuple/tuple.hpp>#include "collvoid_local_planner/ROSAgent.h"#include "collvoid_local_planner/orca.h"#include "collvoid_local_planner/collvoid_publishers.h"
Go to the source code of this file.
Namespaces | |
| namespace | collvoid | 
Functions | |
| void | collvoid::amclPoseArrayWeightedCallback (const amcl::PoseArrayWeighted::ConstPtr &msg) | 
| double | collvoid::CalcArea (std::vector< Vector2 > list) | 
| bool | collvoid::compareConvexHullPointsPosition (const ConvexHullPoint &p1, const ConvexHullPoint &p2) | 
| bool | collvoid::comparePoint (const Vector2 &p1, const Vector2 &p2) | 
| void | collvoid::computeNewLocUncertainty () | 
| void | collvoid::computeNewMinkowskiFootprint () | 
| int | main (int argc, char **argv) | 
| void | collvoid::odomCallback (const nav_msgs::Odometry::ConstPtr &msg) | 
Variables | |
| std::string | collvoid::base_frame_ | 
| double | collvoid::cur_loc_unc_radius_ | 
| double | collvoid::eps_ | 
| geometry_msgs::PolygonStamped | collvoid::footprint_msg_ | 
| double | collvoid::footprint_radius_ | 
| std::string | collvoid::global_frame_ | 
| std::vector< Vector2 > | collvoid::minkowski_footprint_ | 
| std::string | collvoid::odom_frame_ | 
| std::vector< std::pair< double,  geometry_msgs::PoseStamped > >  | collvoid::pose_array_weighted_ | 
| double | collvoid::radius_ | 
| tf::TransformListener * | collvoid::tf_ | 
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 302 of file helper.cpp.