Go to the documentation of this file.00001
00004 #include "mvsim/mvsim_node_core.h"
00005
00006
00007
00008
00009
00010
00011 int main(int argc, char** argv)
00012 {
00013
00014 ros::init(argc, argv, "mvsim");
00015 ros::NodeHandle n;
00016
00017
00018 MVSimNode node(n);
00019
00020
00021 int rate;
00022 std::string world_file;
00023
00024
00025
00026
00027
00028 ros::NodeHandle private_node_handle_("~");
00029 private_node_handle_.param("simul_rate", rate, 100);
00030 private_node_handle_.param("world_file", world_file, std::string(""));
00031
00032
00033 if (!world_file.empty()) node.loadWorldModel(world_file);
00034
00035
00036
00037
00038 dynamic_reconfigure::Server<mvsim::mvsimNodeConfig> dr_srv;
00039 dynamic_reconfigure::Server<mvsim::mvsimNodeConfig>::CallbackType cb;
00040 cb = boost::bind(&MVSimNode::configCallback, &node, _1, _2);
00041 dr_srv.setCallback(cb);
00042
00043
00044
00045
00046
00047
00048
00049
00050
00051
00052 ros::Rate r(rate);
00053
00054
00055 while (n.ok())
00056 {
00057 node.spin();
00058 ros::spinOnce();
00059 r.sleep();
00060 }
00061
00062 return 0;
00063
00064 }