naoqidriver
|
#include <naoqi_driver/naoqi_driver.hpp>
#include <naoqi_driver/message_actions.h>
#include "converters/audio.hpp"
#include "converters/camera.hpp"
#include "converters/diagnostics.hpp"
#include "converters/imu.hpp"
#include "converters/info.hpp"
#include "converters/joint_state.hpp"
#include "converters/laser.hpp"
#include "converters/memory_list.hpp"
#include "converters/sonar.hpp"
#include "converters/memory/bool.hpp"
#include "converters/memory/float.hpp"
#include "converters/memory/int.hpp"
#include "converters/memory/string.hpp"
#include "converters/log.hpp"
#include "publishers/basic.hpp"
#include "publishers/camera.hpp"
#include "publishers/info.hpp"
#include "publishers/joint_state.hpp"
#include "publishers/log.hpp"
#include "publishers/sonar.hpp"
#include "tools/robot_description.hpp"
#include "tools/alvisiondefinitions.h"
#include "subscribers/teleop.hpp"
#include "subscribers/moveto.hpp"
#include "services/robot_config.hpp"
#include "recorder/basic.hpp"
#include "recorder/basic_event.hpp"
#include "recorder/camera.hpp"
#include "recorder/diagnostics.hpp"
#include "recorder/joint_state.hpp"
#include "recorder/sonar.hpp"
#include "event/basic.hpp"
#include "event/audio.hpp"
#include "ros_env.hpp"
#include "helpers/filesystem_helpers.hpp"
#include "helpers/recorder_helpers.hpp"
#include "helpers/naoqi_helpers.hpp"
#include "helpers/driver_helpers.hpp"
#include <tf2_ros/buffer.h>
#include <boost/foreach.hpp>
#include <boost/property_tree/json_parser.hpp>
Namespaces | |
naoqi | |
Macros | |
#define | for_each BOOST_FOREACH |
#define | DEBUG 0 |
Functions | |
naoqi::QI_REGISTER_OBJECT (Driver, _whoIsYourDaddy, minidump, minidumpConverters, setBufferDuration, getBufferDuration, startPublishing, stopPublishing, getMasterURI, setMasterURI, setMasterURINet, getAvailableConverters, getSubscribedPublishers, addMemoryConverters, registerMemoryConverter, registerEventConverter, getFilesList, removeAllFiles, removeFiles, startRecording, startRecordingConverters, stopRecording, startLogging, stopLogging) | |
#define DEBUG 0 |
#define for_each BOOST_FOREACH |