You can not select more than 25 topics
Topics must start with a letter or number, can include dashes ('-') and can be up to 35 characters long.
306 lines
9.3 KiB
306 lines
9.3 KiB
/**************************************************************************** |
|
* |
|
* Copyright (c) 2012-2016 PX4 Development Team. All rights reserved. |
|
* |
|
* Redistribution and use in source and binary forms, with or without |
|
* modification, are permitted provided that the following conditions |
|
* are met: |
|
* |
|
* 1. Redistributions of source code must retain the above copyright |
|
* notice, this list of conditions and the following disclaimer. |
|
* 2. Redistributions in binary form must reproduce the above copyright |
|
* notice, this list of conditions and the following disclaimer in |
|
* the documentation and/or other materials provided with the |
|
* distribution. |
|
* 3. Neither the name PX4 nor the names of its contributors may be |
|
* used to endorse or promote products derived from this software |
|
* without specific prior written permission. |
|
* |
|
* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS |
|
* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT |
|
* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS |
|
* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE |
|
* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, |
|
* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, |
|
* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS |
|
* OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED |
|
* AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT |
|
* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN |
|
* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE |
|
* POSSIBILITY OF SUCH DAMAGE. |
|
* |
|
****************************************************************************/ |
|
|
|
#pragma once |
|
|
|
#include "uORBCommon.hpp" |
|
#include "uORBDeviceMaster.hpp" |
|
|
|
#include <lib/cdev/CDev.hpp> |
|
|
|
#include <containers/IntrusiveSortedList.hpp> |
|
#include <containers/List.hpp> |
|
#include <px4_platform_common/atomic.h> |
|
|
|
namespace uORB |
|
{ |
|
class DeviceNode; |
|
class DeviceMaster; |
|
class Manager; |
|
class SubscriptionCallback; |
|
} |
|
|
|
namespace uORBTest |
|
{ |
|
class UnitTest; |
|
} |
|
|
|
/** |
|
* Per-object device instance. |
|
*/ |
|
class uORB::DeviceNode : public cdev::CDev, public IntrusiveSortedListNode<uORB::DeviceNode *> |
|
{ |
|
public: |
|
DeviceNode(const struct orb_metadata *meta, const uint8_t instance, const char *path, uint8_t queue_size = 1); |
|
virtual ~DeviceNode(); |
|
|
|
// no copy, assignment, move, move assignment |
|
DeviceNode(const DeviceNode &) = delete; |
|
DeviceNode &operator=(const DeviceNode &) = delete; |
|
DeviceNode(DeviceNode &&) = delete; |
|
DeviceNode &operator=(DeviceNode &&) = delete; |
|
|
|
bool operator<=(const DeviceNode &rhs) const { return (strcmp(get_devname(), rhs.get_devname()) <= 0); } |
|
|
|
/** |
|
* Method to create a subscriber instance and return the struct |
|
* pointing to the subscriber as a file pointer. |
|
*/ |
|
int open(cdev::file_t *filp) override; |
|
|
|
/** |
|
* Method to close a subscriber for this topic. |
|
*/ |
|
int close(cdev::file_t *filp) override; |
|
|
|
/** |
|
* reads data from a subscriber node to the buffer provided. |
|
* @param filp |
|
* The subscriber from which the data needs to be read from. |
|
* @param buffer |
|
* The buffer into which the data is read into. |
|
* @param buflen |
|
* the length of the buffer |
|
* @return |
|
* ssize_t the number of bytes read. |
|
*/ |
|
ssize_t read(cdev::file_t *filp, char *buffer, size_t buflen) override; |
|
|
|
/** |
|
* writes the published data to the internal buffer to be read by |
|
* subscribers later. |
|
* @param filp |
|
* the subscriber; this is not used. |
|
* @param buffer |
|
* The buffer for the input data |
|
* @param buflen |
|
* the length of the buffer. |
|
* @return ssize_t |
|
* The number of bytes that are written |
|
*/ |
|
ssize_t write(cdev::file_t *filp, const char *buffer, size_t buflen) override; |
|
|
|
/** |
|
* IOCTL control for the subscriber. |
|
*/ |
|
int ioctl(cdev::file_t *filp, int cmd, unsigned long arg) override; |
|
|
|
/** |
|
* Method to publish a data to this node. |
|
*/ |
|
static ssize_t publish(const orb_metadata *meta, orb_advert_t handle, const void *data); |
|
|
|
static int unadvertise(orb_advert_t handle); |
|
|
|
#ifdef ORB_COMMUNICATOR |
|
static int16_t topic_advertised(const orb_metadata *meta); |
|
//static int16_t topic_unadvertised(const orb_metadata *meta); |
|
|
|
/** |
|
* processes a request for add subscription from remote |
|
* @param rateInHz |
|
* Specifies the desired rate for the message. |
|
* @return |
|
* 0 = success |
|
* otherwise failure. |
|
*/ |
|
int16_t process_add_subscription(int32_t rateInHz); |
|
|
|
/** |
|
* processes a request to remove a subscription from remote. |
|
*/ |
|
int16_t process_remove_subscription(); |
|
|
|
/** |
|
* processed the received data message from remote. |
|
*/ |
|
int16_t process_received_message(int32_t length, uint8_t *data); |
|
#endif /* ORB_COMMUNICATOR */ |
|
|
|
/** |
|
* Add the subscriber to the node's list of subscriber. If there is |
|
* remote proxy to which this subscription needs to be sent, it will |
|
* done via uORBCommunicator::IChannel interface. |
|
* @param sd |
|
* the subscriber to be added. |
|
*/ |
|
void add_internal_subscriber(); |
|
|
|
/** |
|
* Removes the subscriber from the list. Also notifies the remote |
|
* if there a uORBCommunicator::IChannel instance. |
|
* @param sd |
|
* the Subscriber to be removed. |
|
*/ |
|
void remove_internal_subscriber(); |
|
|
|
/** |
|
* Return true if this topic has been advertised. |
|
* |
|
* This is used in the case of multi_pub/sub to check if it's valid to advertise |
|
* and publish to this node or if another node should be tried. */ |
|
bool is_advertised() const { return _advertised; } |
|
|
|
void mark_as_advertised() { _advertised = true; } |
|
|
|
/** |
|
* Try to change the size of the queue. This can only be done as long as nobody published yet. |
|
* This is the case, for example when orb_subscribe was called before an orb_advertise. |
|
* The queue size can only be increased. |
|
* @param queue_size new size of the queue |
|
* @return PX4_OK if queue size successfully set |
|
*/ |
|
int update_queue_size(unsigned int queue_size); |
|
|
|
/** |
|
* Print statistics |
|
* @param max_topic_length max topic name length for printing |
|
* @return true if printed something, false otherwise |
|
*/ |
|
bool print_statistics(int max_topic_length); |
|
|
|
uint8_t get_queue_size() const { return _queue_size; } |
|
|
|
int8_t subscriber_count() const { return _subscriber_count; } |
|
|
|
/** |
|
* Returns the number of updated data relative to the parameter 'generation' |
|
* We can get the correct value regardless of wrap-around or not. |
|
* @param generation The generation of subscriber |
|
*/ |
|
unsigned updates_available(unsigned generation) const { return _generation.load() - generation; } |
|
|
|
/** |
|
* Return the initial generation to the subscriber |
|
* @return The initial generation. |
|
*/ |
|
unsigned get_initial_generation(); |
|
|
|
const orb_metadata *get_meta() const { return _meta; } |
|
|
|
ORB_ID id() const { return static_cast<ORB_ID>(_meta->o_id); } |
|
|
|
const char *get_name() const { return _meta->o_name; } |
|
|
|
uint8_t get_instance() const { return _instance; } |
|
|
|
/** |
|
* Copies data and the corresponding generation |
|
* from a node to the buffer provided. |
|
* |
|
* @param dst |
|
* The buffer into which the data is copied. |
|
* @param generation |
|
* The generation that was copied. |
|
* @return bool |
|
* Returns true if the data was copied. |
|
*/ |
|
bool copy(void *dst, unsigned &generation) |
|
{ |
|
if ((dst != nullptr) && (_data != nullptr)) { |
|
if (_queue_size == 1) { |
|
ATOMIC_ENTER; |
|
memcpy(dst, _data, _meta->o_size); |
|
generation = _generation.load(); |
|
ATOMIC_LEAVE; |
|
return true; |
|
|
|
} else { |
|
ATOMIC_ENTER; |
|
const unsigned current_generation = _generation.load(); |
|
|
|
if (current_generation == generation) { |
|
/* The subscriber already read the latest message, but nothing new was published yet. |
|
* Return the previous message |
|
*/ |
|
--generation; |
|
} |
|
|
|
// Compatible with normal and overflow conditions |
|
if (!is_in_range(current_generation - _queue_size, generation, current_generation - 1)) { |
|
// Reader is too far behind: some messages are lost |
|
generation = current_generation - _queue_size; |
|
} |
|
|
|
memcpy(dst, _data + (_meta->o_size * (generation % _queue_size)), _meta->o_size); |
|
ATOMIC_LEAVE; |
|
|
|
++generation; |
|
|
|
return true; |
|
} |
|
} |
|
|
|
return false; |
|
|
|
} |
|
|
|
// add item to list of work items to schedule on node update |
|
bool register_callback(SubscriptionCallback *callback_sub); |
|
|
|
// remove item from list of work items |
|
void unregister_callback(SubscriptionCallback *callback_sub); |
|
|
|
protected: |
|
|
|
px4_pollevent_t poll_state(cdev::file_t *filp) override; |
|
|
|
void poll_notify_one(px4_pollfd_struct_t *fds, px4_pollevent_t events) override; |
|
|
|
private: |
|
friend uORBTest::UnitTest; |
|
|
|
const orb_metadata *_meta; /**< object metadata information */ |
|
|
|
uint8_t *_data{nullptr}; /**< allocated object buffer */ |
|
bool _data_valid{false}; /**< At least one valid data */ |
|
px4::atomic<unsigned> _generation{0}; /**< object generation count */ |
|
List<uORB::SubscriptionCallback *> _callbacks; |
|
|
|
const uint8_t _instance; /**< orb multi instance identifier */ |
|
bool _advertised{false}; /**< has ever been advertised (not necessarily published data yet) */ |
|
uint8_t _queue_size; /**< maximum number of elements in the queue */ |
|
int8_t _subscriber_count{0}; |
|
|
|
|
|
// Determine the data range |
|
static inline bool is_in_range(unsigned left, unsigned value, unsigned right) |
|
{ |
|
if (right > left) { |
|
return (left <= value) && (value <= right); |
|
|
|
} else { // Maybe the data overflowed and a wraparound occurred |
|
return (left <= value) || (value <= right); |
|
} |
|
} |
|
};
|
|
|