00001 /* 00002 * TeleKybCore.hpp 00003 * 00004 * Created on: Nov 3, 2011 00005 * Author: mriedel 00006 */ 00007 00008 #ifndef TELEKYBCORE_HPP_ 00009 #define TELEKYBCORE_HPP_ 00010 00011 #include <telekyb_defines/telekyb_defines.hpp> 00012 // Options 00013 #include <telekyb_core/TeleKybCoreOptions.hpp> 00014 // Behavior 00015 #include <tk_behavior/BehaviorController.hpp> 00016 // State 00017 #include <tk_state/StateEstimatorController.hpp> 00018 // TrajController 00019 #include <tk_trajctrl/TrajectoryController.hpp> 00020 // TrajProcessor 00021 #include <tk_trajprocessor/TrajectoryProcessorController.hpp> 00022 00023 // Interface 00024 #include <telekyb_core/TeleKybCoreInterface.hpp> 00025 00026 // ros 00027 #include <ros/ros.h> 00028 00029 00030 namespace TELEKYB_NAMESPACE { 00031 00032 class TeleKybCore { 00033 protected: 00034 //options 00035 TeleKybCoreOptions options; 00036 00037 // ROS 00038 ros::NodeHandle nodeHandle; 00039 00040 00041 // Interface 00042 TeleKybCoreInterface* interface; 00043 00044 public: 00045 TeleKybCore(); 00046 virtual ~TeleKybCore(); 00047 }; 00048 00049 } 00050 00051 #endif /* TELEKYBCORE_HPP_ */