step_controller_node.cpp
Go to the documentation of this file.
00001 #include <vigir_step_control/step_controller_node.h>
00002 
00003 #include <vigir_generic_params/parameter_manager.h>
00004 #include <vigir_pluginlib/plugin_manager.h>
00005 
00006 
00007 
00008 namespace vigir_step_control
00009 {
00010 StepControllerNode::StepControllerNode(ros::NodeHandle& nh)
00011 {
00012   step_controller_.reset(new StepController(nh, nh.param("auto_spin", true)));
00013 }
00014 
00015 StepControllerNode::~StepControllerNode()
00016 {
00017 }
00018 } // namespace
00019 
00020 int main(int argc, char **argv)
00021 {
00022   ros::init(argc, argv, "vigir_step_controller");
00023 
00024   ros::NodeHandle nh;
00025 
00026   // ensure that node's services are set up in proper namespace
00027   if (nh.getNamespace().size() <= 1)
00028     nh = ros::NodeHandle("~");
00029 
00030   // init parameter and plugin manager
00031   vigir_generic_params::ParameterManager::initialize(nh);
00032   vigir_pluginlib::PluginManager::initialize(nh);
00033 
00034   vigir_step_control::StepControllerNode step_controller_node(nh);
00035 
00036   ros::spin();
00037 
00038   return 0;
00039 }


vigir_step_control
Author(s): Alexander Stumpf
autogenerated on Fri Jul 14 2017 02:42:09