Functions | Variables
APgenerator.cpp File Reference
#include <stdio.h>
#include <vector>
#include <math.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <numeric>
#include <interactive_markers/interactive_marker_server.h>
#include <interactive_markers/menu_handler.h>
#include <boost/lexical_cast.hpp>
#include <boost/format.hpp>
#include "std_msgs/String.h"
#include <trajectory_planner/coordinates.h>
Include dependency graph for APgenerator.cpp:

Go to the source code of this file.

Functions

int main (int argc, char **argv)
 
void make6DofMarker (bool fixed)
 
Marker makeBox (InteractiveMarker &msg)
 
InteractiveMarkerControl & makeBoxControl (InteractiveMarker &msg)
 
void processFeedback (const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback)
 

Variables

ros::Publisher coor_pub
 
trajectory_planner::coordinates message
 
ros::NodeHandle * p_n
 
boost::shared_ptr
< interactive_markers::InteractiveMarkerServer > 
server
 

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 150 of file APgenerator.cpp.

void make6DofMarker ( bool  fixed)

Definition at line 105 of file APgenerator.cpp.

Marker makeBox ( InteractiveMarker &  msg)

Definition at line 78 of file APgenerator.cpp.

InteractiveMarkerControl& makeBoxControl ( InteractiveMarker &  msg)

Definition at line 94 of file APgenerator.cpp.

void processFeedback ( const visualization_msgs::InteractiveMarkerFeedbackConstPtr &  feedback)

Definition at line 51 of file APgenerator.cpp.

Variable Documentation

ros::Publisher coor_pub

Definition at line 46 of file APgenerator.cpp.

trajectory_planner::coordinates message

Definition at line 47 of file APgenerator.cpp.

ros::NodeHandle* p_n

Definition at line 45 of file APgenerator.cpp.

boost::shared_ptr<interactive_markers::InteractiveMarkerServer> server

Definition at line 44 of file APgenerator.cpp.



trajectory_planner
Author(s): Joel Pereira
autogenerated on Mon Mar 2 2015 01:32:54