$search
#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>
Go to the source code of this file.
| Classes | |
| class | PathFollower | 
| Typedefs | |
| typedef std::vector < geometry_msgs::PoseStamped > ::const_iterator | PathIterator | 
| Functions | |
| double | distance (const tf::Pose &p1, const tf::Pose &p2) | 
| tf::Quaternion | getOrientationBetween (const tf::Transform &p1, const tf::Transform &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) | 
| void | print_transform (const tf::Transform &t) | 
| typedef std::vector< geometry_msgs::PoseStamped>::const_iterator PathIterator | 
Definition at line 289 of file nao_path_follower.cpp.
Definition at line 249 of file nao_path_follower.cpp.
| tf::Quaternion getOrientationBetween | ( | const tf::Transform & | p1, | |
| const tf::Transform & | p2 | |||
| ) | 
Definition at line 266 of file nao_path_follower.cpp.
| double getYawBetween | ( | const tf::Transform & | p1, | |
| const tf::Transform & | p2 | |||
| ) | 
Definition at line 260 of file nao_path_follower.cpp.
| bool hasOrientation | ( | const geometry_msgs::Pose & | pose | ) | 
Definition at line 215 of file nao_path_follower.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) | 
Definition at line 918 of file nao_path_follower.cpp.
| double moveAlongPathByDistance | ( | const PathIterator & | start, | |
| PathIterator & | end, | |||
| double | targetDistance | |||
| ) | 
Definition at line 291 of file nao_path_follower.cpp.
| void print_transform | ( | const tf::Transform & | t | ) | 
Definition at line 254 of file nao_path_follower.cpp.