#include <ros/ros.h>
#include "articulation_msgs/ModelMsg.h"
#include "articulation_msgs/TrackMsg.h"
#include "articulation_msgs/ParamMsg.h"
#include "articulation_models/models/factory.h"
#include "articulation_models/utils.h"
#include <boost/foreach.hpp>
Go to the source code of this file.
Defines | |
#define | DEBUG false |
#define | SQR(a) ((a)*(a)) |
Functions | |
void | ADD_DATA (string name, double data) |
void | EVAL () |
int | main (int argc, char **argv) |
void | TIC (string name) |
void | TOC (string name) |
void | trackCallback (const TrackMsgConstPtr &track) |
Variables | |
MultiModelFactory | factory |
map< string, vector< double > > | measurements |
ros::Publisher | model_pub |
GenericModelVector | models_valid |
ros::NodeHandle * | nh |
double | sigma_orientation = 4*M_PI |
double | sigma_position = 0.01 |
map< string, ros::Time > | startingTime |
#define DEBUG false |
Definition at line 18 of file model_learner_msg.cpp.
#define SQR | ( | a | ) | ((a)*(a)) |
Definition at line 51 of file model_learner_msg.cpp.
void ADD_DATA | ( | string | name, |
double | data | ||
) |
Definition at line 46 of file model_learner_msg.cpp.
void EVAL | ( | ) |
Definition at line 52 of file model_learner_msg.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 176 of file model_learner_msg.cpp.
void TIC | ( | string | name | ) |
Definition at line 38 of file model_learner_msg.cpp.
void TOC | ( | string | name | ) |
Definition at line 42 of file model_learner_msg.cpp.
void trackCallback | ( | const TrackMsgConstPtr & | track | ) |
Definition at line 70 of file model_learner_msg.cpp.
Definition at line 26 of file model_learner_msg.cpp.
map<string, vector<double> > measurements |
Definition at line 31 of file model_learner_msg.cpp.
Definition at line 24 of file model_learner_msg.cpp.
Definition at line 28 of file model_learner_msg.cpp.
Definition at line 33 of file model_learner_msg.cpp.
double sigma_orientation = 4*M_PI |
Definition at line 35 of file model_learner_msg.cpp.
double sigma_position = 0.01 |
Definition at line 34 of file model_learner_msg.cpp.
map<string, ros::Time> startingTime |
Definition at line 30 of file model_learner_msg.cpp.