Classes | |
| class | Conversion |
| class | Exception |
| class | Object |
| class | Options |
| class | Param |
| class | Publisher |
| class | Subscriber |
| class | SubscriptionCallbackHelper |
Typedefs | |
| typedef mxArray * | Array |
| typedef mxArray const * | ConstArray |
| typedef boost::shared_ptr < Conversion > | ConversionPtr |
Functions | |
| template<class Type > | |
| Type * | getObject (const mxArray *handle) |
| void | init () |
| ros::NodeHandle & | nodeHandle () |
| static ros::SerializedMessage | serialize (const cpp_introspection::MessagePtr &message) |
| void | shutdown () |
Variables | |
| static const ros::WallDuration | DEFAULT_TIMEOUT (1e-3) |
| ros::NodeHandle * | node_handle_ = 0 |
| ros::AsyncSpinner * | spinner_ = 0 |
| typedef mxArray* rosmatlab::Array |
Definition at line 42 of file conversion.h.
| typedef mxArray const* rosmatlab::ConstArray |
Definition at line 43 of file conversion.h.
| typedef boost::shared_ptr<Conversion> rosmatlab::ConversionPtr |
Definition at line 39 of file conversion.h.
| Type* rosmatlab::getObject | ( | const mxArray * | handle | ) |
| void rosmatlab::init | ( | ) |
| static ros::SerializedMessage rosmatlab::serialize | ( | const cpp_introspection::MessagePtr & | message | ) | [static] |
Definition at line 101 of file publisher.cpp.
| void rosmatlab::shutdown | ( | ) |
const ros::WallDuration rosmatlab::DEFAULT_TIMEOUT(1e-3) [static] |