Tools for more convenient working with ShapeShifter objects. More...
#include <sstream>
#include <topic_tools/shape_shifter.h>
#include <algorithm>
#include <utility>
#include <boost/shared_ptr.hpp>
#include <ros/common.h>
#include <ros/serialization.h>
#include <std_msgs/Header.h>
#include <cras_cpp_common/optional.hpp>
#include <cras_cpp_common/string_utils.hpp>
#include <cras_topic_tools/shape_shifter.h>
Go to the source code of this file.
Namespaces | |
cras | |
Macros | |
#define | private public |
Functions | |
void | cras::copyShapeShifter (const topic_tools::ShapeShifter &in, topic_tools::ShapeShifter &out) |
const uint8_t * | cras::getBuffer (const topic_tools::ShapeShifter &msg) |
uint8_t * | cras::getBuffer (topic_tools::ShapeShifter &msg) |
size_t | cras::getBufferLength (const topic_tools::ShapeShifter &msg) |
cras::optional< std_msgs::Header > | cras::getHeader (const topic_tools::ShapeShifter &msg) |
bool | cras::hasHeader (const topic_tools::ShapeShifter &msg) |
void | cras::resizeBuffer (topic_tools::ShapeShifter &msg, size_t newLength) |
bool | cras::setHeader (topic_tools::ShapeShifter &msg, std_msgs::Header &header) |
Tools for more convenient working with ShapeShifter objects.
Definition in file shape_shifter.cpp.
#define private public |
Definition at line 12 of file shape_shifter.cpp.