WIP, towards more px4 compatibility, first macros

This commit is contained in:
Thomas Gubler 2014-11-25 11:50:35 +01:00
parent c167df9038
commit 55cf2fc61c
8 changed files with 69 additions and 8 deletions

View File

@ -57,7 +57,7 @@ int main(int argc, char **argv)
* than we can send them, the number here specifies how many messages to
* buffer up before throwing some away.
*/
px4::Publisher rc_channels_pub = n.advertise<px4::rc_channels>("rc_channels");
px4::Publisher rc_channels_pub = n.advertise<px4::rc_channels>(PX4_TOPIC(rc_channels));
px4::Rate loop_rate(10);

View File

@ -74,7 +74,7 @@ int main(int argc, char **argv)
* is the number of messages that will be buffered up before beginning to throw
* away the oldest ones.
*/
px4::Subscriber sub = n.subscribe("rc_channels", rc_channels_callback);
px4::Subscriber sub = n.subscribe(PX4_TOPIC(rc_channels), rc_channels_callback);
PX4_INFO("subscribed");
/**

View File

@ -46,14 +46,19 @@
* Building for running within the ROS environment
*/
#include "ros/ros.h"
#define PX4_WARN ROS_WARN
#define PX4_INFO ROS_INFO
#define PX4_TOPIC(name) #name
#else
/*
* Building for NuttX
*/
#include <uORB/uORB.h>
#define PX4_WARN warnx
#define PX4_INFO warnx
#define PX4_TOPIC(name) ORB_ID(name)
#endif
#include "../platforms/px4_defines.h"

View File

@ -78,5 +78,6 @@ template class __EXPORT Publication<vehicle_rates_setpoint_s>;
template class __EXPORT Publication<actuator_outputs_s>;
template class __EXPORT Publication<encoders_s>;
template class __EXPORT Publication<tecs_status_s>;
template class __EXPORT Publication<rc_channels_s>;
}

View File

@ -101,5 +101,6 @@ template class __EXPORT Subscription<vehicle_local_position_setpoint_s>;
template class __EXPORT Subscription<vehicle_local_position_s>;
template class __EXPORT Subscription<vehicle_attitude_setpoint_s>;
template class __EXPORT Subscription<vehicle_rates_setpoint_s>;
template class __EXPORT Subscription<rc_channels_s>;
} // namespace uORB

View File

@ -49,13 +49,14 @@
#include <inttypes.h>
#else
/* includes when building for NuttX */
#include <containers/List.hpp>
#endif
namespace px4
{
#if defined(__linux) || (defined(__APPLE__) && defined(__MACH__))
class NodeHandle : private ros::NodeHandle
class NodeHandle :
private ros::NodeHandle
{
public:
NodeHandle() :
@ -64,6 +65,10 @@ public:
_pubs()
{}
~NodeHandle() {
//XXX empty lists
};
template<typename M>
Subscriber subscribe(const char *topic, void(*fp)(M)) {
ros::Subscriber ros_sub = ros::NodeHandle::subscribe(topic, kQueueSizeDefault, fp);
@ -87,6 +92,30 @@ private:
#else
class NodeHandle
{
public:
NodeHandle() :
_subs(),
_pubs()
{}
~NodeHandle() {};
template<typename M>
Subscriber subscribe(const char *topic, void(*fp)(M)) {
Subscriber sub(&_subs, , interval);
return sub;
}
template<typename M>
Publisher advertise(const char *topic) {
Publisher pub(ros_pub);
_pubs.push_back(pub);
return pub;
}
private:
List<Subscriber> _subs;
List<Publisher> _pubs;
};
#endif
}

View File

@ -38,7 +38,11 @@
*/
#pragma once
#if defined(__linux) || (defined(__APPLE__) && defined(__MACH__))
/* includes when building for ros */
#include "ros/ros.h"
#else
/* includes when building for NuttX */
#include <uORB/Publication.hpp>
#endif
namespace px4
@ -56,7 +60,15 @@ private:
ros::Publisher _ros_pub;
};
#else
class Publisher
template<typename M>
class Publisher :
public uORB::Publication<M>
public:
Publisher(List<SubscriptionBase *> * list,
const struct orb_metadata *meta, unsigned interval) :
uORB::Publication(list, meta)
{}
~Publisher() {};
{
};
#endif

View File

@ -38,7 +38,11 @@
*/
#pragma once
#if defined(__linux) || (defined(__APPLE__) && defined(__MACH__))
/* includes when building for ros */
#include "ros/ros.h"
#else
/* includes when building for NuttX */
#include <uORB/Subscription.hpp>
#endif
namespace px4
@ -48,14 +52,23 @@ namespace px4
class Subscriber
{
public:
Subscriber(ros::Subscriber ros_sub) : _ros_sub(ros_sub)
Subscriber(ros::Subscriber ros_sub) :
_ros_sub(ros_sub)
{}
~Subscriber() {};
private:
ros::Subscriber _ros_sub;
};
#else
class Subscriber
template<typename M>
class Subscriber :
public uORB::Subscription<M>
public:
Subscriber(List<SubscriptionBase *> * list,
const struct orb_metadata *meta, unsigned interval) :
uORB::Subsciption(list, meta, interval)
{}
~Subscriber() {};
{
};
#endif