#include <ros/ros.h>
#include <ros/callback_queue.h>
#include <blackboard/remote.h>
#include <blackboard/interface_listener.h>
#include <interfaces/ZoneInterface.h>
#include <interfaces/Position3DInterface.h>
#include <interfaces/TagVisionInterface.h>
#include <interfaces/RobotinoLightInterface.h>
#include <interfaces/NavGraphWithMPSGeneratorInterface.h>
#include <utils/time/time.h>
#include <rcll_fawkes_sim_msgs/ExplorationZoneInfo.h>
#include <rcll_fawkes_sim_msgs/MPSMarkerArray.h>
#include <rcll_fawkes_sim_msgs/MPSLightState.h>
#include <rcll_fawkes_sim_msgs/NavgraphWithMPSGenerate.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <memory>
Go to the source code of this file.
#define GET_PRIV_PARAM |
( |
|
P | ) |
|
Value:{ \
exit(-1); \
} \
}
ROSCPP_DECL const std::string & getName()
ROSCPP_DECL bool get(const std::string &key, std::string &s)
Definition at line 43 of file rcll_fawkes_sim_node.cpp.
int fawkes_to_ros_light_state |
( |
const fawkes::RobotinoLightInterface::LightState & |
state | ) |
|
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
fawkes::NavGraphWithMPSGeneratorInterface::Side ros_to_fawkes_mps_side |
( |
int |
side | ) |
|