structure_learner_st.cpp
Go to the documentation of this file.
00001 /*
00002  * structure_learner.cpp
00003  *
00004  *  Created on: Jun 22, 2010
00005  *      Author: sturm
00006  */
00007 
00008 #include "structure_learner_st.h"
00009 
00010 int main(int argc, char** argv) {
00011         ros::init(argc, argv, "model_learner");
00012 
00013         KinematicStructureLearner learner;
00014 
00015         ros::NodeHandle nh;
00016         ros::Publisher lifebeat_pub = nh.advertise<std_msgs::Empty> ("/lifebeat", 1);
00017         while (nh.ok()) {
00018 //              cout << "lifebeat.." << learner.intersectionOfStamps().size() << endl;
00019                 ros::Rate loop_rate(3);
00020                 loop_rate.sleep();
00021                 ros::spinOnce();
00022 
00023                 lifebeat_pub.publish(std_msgs::Empty());
00024         }
00025 }
 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