Functions | Variables
gotoRelativePose.cpp File Reference
#include <stdlib.h>
#include <string.h>
#include <ros/ros.h>
#include <nav_msgs/Odometry.h>
#include <osg/Quat>
#include <osg/Vec3d>
#include <osg/Matrix>
Include dependency graph for gotoRelativePose.cpp:

Go to the source code of this file.

Functions

int main (int argc, char **argv)
void vehiclePoseCallback (const nav_msgs::Odometry &odom)

Variables

double currentDistance
osg::Quat currentQ
osg::Vec3d currentT
bool firstpass = false
osg::Quat goalQ
osg::Vec3d goalT
osg::Quat initialQ
osg::Vec3d initialT
double pitch
double roll
double totalDistance
double x
double y
double yaw
double z

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 58 of file gotoRelativePose.cpp.

void vehiclePoseCallback ( const nav_msgs::Odometry &  odom)

Definition at line 33 of file gotoRelativePose.cpp.


Variable Documentation

Definition at line 30 of file gotoRelativePose.cpp.

osg::Quat currentQ

Definition at line 28 of file gotoRelativePose.cpp.

osg::Vec3d currentT

Definition at line 29 of file gotoRelativePose.cpp.

bool firstpass = false

Definition at line 27 of file gotoRelativePose.cpp.

osg::Quat goalQ

Definition at line 28 of file gotoRelativePose.cpp.

osg::Vec3d goalT

Definition at line 29 of file gotoRelativePose.cpp.

osg::Quat initialQ

Definition at line 28 of file gotoRelativePose.cpp.

osg::Vec3d initialT

Definition at line 29 of file gotoRelativePose.cpp.

double pitch

Definition at line 31 of file gotoRelativePose.cpp.

double roll

Definition at line 31 of file gotoRelativePose.cpp.

double totalDistance

Definition at line 30 of file gotoRelativePose.cpp.

double x

Definition at line 31 of file gotoRelativePose.cpp.

double y

Definition at line 31 of file gotoRelativePose.cpp.

double yaw

Definition at line 31 of file gotoRelativePose.cpp.

double z

Definition at line 31 of file gotoRelativePose.cpp.



uwsim
Author(s): Mario Prats
autogenerated on Mon Oct 6 2014 08:24:07