Classes | Typedefs | Functions
nao_path_follower.cpp File Reference
#include <ros/ros.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
#include <geometry_msgs/Transform.h>
#include <std_msgs/Bool.h>
#include <std_srvs/Empty.h>
#include <cmath>
#include <geometry_msgs/Pose2D.h>
#include <nav_msgs/Path.h>
#include <geometry_msgs/PoseStamped.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <nao_msgs/FollowPathAction.h>
#include <actionlib/server/simple_action_server.h>
#include <angles/angles.h>
#include <assert.h>
Include dependency graph for nao_path_follower.cpp:

Go to the source code of this file.

Classes

class  PathFollower

Typedefs

typedef std::vector
< geometry_msgs::PoseStamped >
::const_iterator 
PathIterator

Functions

tf::Quaternion getOrientationBetween (const tf::Transform &p1, const tf::Transform &p2)
tf::Quaternion getOrientationBetween (const geometry_msgs::Pose &p1, const geometry_msgs::Pose &p2)
double getYawBetween (const geometry_msgs::Pose &p1, const geometry_msgs::Pose &p2)
double getYawBetween (const tf::Transform &p1, const tf::Transform &p2)
bool hasOrientation (const geometry_msgs::Pose &pose)
int main (int argc, char **argv)
double moveAlongPathByDistance (const PathIterator &start, PathIterator &end, double targetDistance)
double poseDist (const tf::Pose &p1, const tf::Pose &p2)
double poseDist (const geometry_msgs::Pose &p1, const geometry_msgs::Pose &p2)
void print_transform (const tf::Transform &t)

Typedef Documentation

typedef std::vector< geometry_msgs::PoseStamped>::const_iterator PathIterator

Definition at line 322 of file nao_path_follower.cpp.


Function Documentation

Definition at line 309 of file nao_path_follower.cpp.

Definition at line 315 of file nao_path_follower.cpp.

double getYawBetween ( const geometry_msgs::Pose p1,
const geometry_msgs::Pose p2 
)

Definition at line 295 of file nao_path_follower.cpp.

double getYawBetween ( const tf::Transform p1,
const tf::Transform p2 
)

Definition at line 303 of file nao_path_follower.cpp.

bool hasOrientation ( const geometry_msgs::Pose pose)

Definition at line 241 of file nao_path_follower.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 897 of file nao_path_follower.cpp.

double moveAlongPathByDistance ( const PathIterator start,
PathIterator end,
double  targetDistance 
)

Definition at line 324 of file nao_path_follower.cpp.

double poseDist ( const tf::Pose p1,
const tf::Pose p2 
)

Definition at line 275 of file nao_path_follower.cpp.

double poseDist ( const geometry_msgs::Pose p1,
const geometry_msgs::Pose p2 
)

Definition at line 280 of file nao_path_follower.cpp.

void print_transform ( const tf::Transform t)

Definition at line 288 of file nao_path_follower.cpp.



nao_path_follower
Author(s): Armin Hornung, Stefan Osswald, Daniel Maier
autogenerated on Mon Oct 6 2014 02:38:38