LLJoystickOptions.cpp
Go to the documentation of this file.
00001 /*
00002  * LLJoystickOptions.cpp
00003  *
00004  *  Created on: Oct 29, 2011
00005  *      Author: mriedel
00006  */
00007 
00008 #include "LLJoystickOptions.hpp"
00009 
00010 namespace TELEKYB_NAMESPACE {
00011 
00012 LLJoystickOptions::LLJoystickOptions()
00013         : OptionContainer("LLJoystick")
00014 {
00015         tJoystickTopic = addOption<std::string>("tJoystickTopic","Joystick Topic with sensor_msgs::Joy",
00016                         "/TeleKyb/tJoy/joy", false, true);
00017         tLLCommandsTopic = addOption<std::string>("tLLCommandsTopic","Topic for publishing telekyb_msgs::LLCommands",
00018                         "/TeleKyb/SwarmSimX/0/commands", false, true);
00019 
00020         tCommandRate = addOption<int>("tCommandRate","Rate at which LLCommands are send in (Hz)",
00021                         100, false, true);
00022 
00023 }
00024 
00025 
00026 }
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends Defines


telekyb_core
Author(s): Dr. Antonio Franchi and Martin Riedel
autogenerated on Mon Nov 11 2013 11:13:47