Functions | Variables
structure_learner_srv.cpp File Reference
#include <ros/ros.h>
#include <boost/foreach.hpp>
#include "ArticulatedObject.h"
#include "visualization_msgs/Marker.h"
#include "visualization_msgs/MarkerArray.h"
Include dependency graph for structure_learner_srv.cpp:

Go to the source code of this file.

Functions

void AddMarkerLine (string ns, Point point_from, Point point_to, double size=0.01, double H=0, double S=1, double V=1, Point point_relative=Point())
void AddMarkerLine (string ns, Pose pose_from, Pose pose_to, double size=0.01, double H=0, double S=1, double V=1, Pose relative=Pose())
void AddMarkerPoint (string ns, Point point, double size=0.01, double H=0, double S=1, double V=1)
void AddText (string ns, Point point, string s="hello", double size=0.05, double H=0, double S=1, double V=1)
void DeleteOldMarkers ()
tf::Vector3 getOrtho (tf::Vector3 a, tf::Vector3 b)
int main (int argc, char **argv)
bool structureFitModels (articulation_msgs::ArticulatedObjectSrv::Request &request, articulation_msgs::ArticulatedObjectSrv::Response &response)
bool structureSelectFastGraph (articulation_msgs::ArticulatedObjectSrv::Request &request, articulation_msgs::ArticulatedObjectSrv::Response &response)
bool structureSelectGraph (articulation_msgs::ArticulatedObjectSrv::Request &request, articulation_msgs::ArticulatedObjectSrv::Response &response)
bool structureSelectGraphAll (articulation_msgs::ArticulatedObjectSrv::Request &request, articulation_msgs::ArticulatedObjectSrv::Response &response)
bool structureSelectSpanningTree (articulation_msgs::ArticulatedObjectSrv::Request &request, articulation_msgs::ArticulatedObjectSrv::Response &response)
bool visualizeGraph (articulation_msgs::ArticulatedObjectSrv::Request &request, articulation_msgs::ArticulatedObjectSrv::Response &response)

Variables

ros::Publisher marker_pub
map< string, MarkerArray > markers
ros::Publisher model_pub
ros::NodeHandlenh
ros::NodeHandlenh_local
map< string, MarkerArray > old_markers
vector< int > old_model_ids
KinematicParams params
ros::Publisher track_pub

Function Documentation

void AddMarkerLine ( string  ns,
Point  point_from,
Point  point_to,
double  size = 0.01,
double  H = 0,
double  S = 1,
double  V = 1,
Point  point_relative = Point() 
)

Definition at line 115 of file structure_learner_srv.cpp.

void AddMarkerLine ( string  ns,
Pose  pose_from,
Pose  pose_to,
double  size = 0.01,
double  H = 0,
double  S = 1,
double  V = 1,
Pose  relative = Pose() 
)

Definition at line 154 of file structure_learner_srv.cpp.

void AddMarkerPoint ( string  ns,
Point  point,
double  size = 0.01,
double  H = 0,
double  S = 1,
double  V = 1 
)

Definition at line 140 of file structure_learner_srv.cpp.

void AddText ( string  ns,
Point  point,
string  s = "hello",
double  size = 0.05,
double  H = 0,
double  S = 1,
double  V = 1 
)

Definition at line 166 of file structure_learner_srv.cpp.

void DeleteOldMarkers ( )

Definition at line 182 of file structure_learner_srv.cpp.

Definition at line 195 of file structure_learner_srv.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 531 of file structure_learner_srv.cpp.

Definition at line 29 of file structure_learner_srv.cpp.

Definition at line 59 of file structure_learner_srv.cpp.

Definition at line 76 of file structure_learner_srv.cpp.

Definition at line 93 of file structure_learner_srv.cpp.

Definition at line 43 of file structure_learner_srv.cpp.

Definition at line 202 of file structure_learner_srv.cpp.


Variable Documentation

Definition at line 25 of file structure_learner_srv.cpp.

map<string,MarkerArray> markers

Definition at line 112 of file structure_learner_srv.cpp.

Definition at line 23 of file structure_learner_srv.cpp.

Definition at line 20 of file structure_learner_srv.cpp.

Definition at line 21 of file structure_learner_srv.cpp.

map<string,MarkerArray> old_markers

Definition at line 112 of file structure_learner_srv.cpp.

Definition at line 113 of file structure_learner_srv.cpp.

Definition at line 27 of file structure_learner_srv.cpp.

Definition at line 24 of file structure_learner_srv.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends Defines


articulation_structure
Author(s): sturm
autogenerated on Wed Dec 26 2012 15:37:59