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));
00013   step_controller_->initialize(nh, nh.param("auto_spin", true));
00014 }
00015 
00016 StepControllerNode::~StepControllerNode()
00017 {
00018 }
00019 } // namespace
00020 
00021 int main(int argc, char **argv)
00022 {
00023   ros::init(argc, argv, "vigir_step_controller");
00024 
00025   ros::NodeHandle nh;
00026 
00027   // ensure that node's services are set up in proper namespace
00028   if (nh.getNamespace().size() <= 1)
00029     nh = ros::NodeHandle("~");
00030 
00031   // init parameter and plugin manager
00032   vigir_generic_params::ParameterManager::initialize(nh);
00033   vigir_pluginlib::PluginManager::initialize(nh);
00034 
00035   vigir_step_control::StepControllerNode step_controller_node(nh);
00036 
00037   ros::spin();
00038 
00039   return 0;
00040 }


vigir_step_control
Author(s): Alexander Stumpf
autogenerated on Thu Jun 6 2019 21:13:33