Public Member Functions | Private Attributes
Diffbot< NUM_JOINTS > Class Template Reference

#include <diffbot.h>

Inheritance diagram for Diffbot< NUM_JOINTS >:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 Diffbot ()
ros::Duration getPeriod () const
ros::Time getTime () const
void read ()
bool start_callback (std_srvs::Empty::Request &, std_srvs::Empty::Response &)
bool stop_callback (std_srvs::Empty::Request &, std_srvs::Empty::Response &)
void write ()

Private Attributes

double cmd_ [NUM_JOINTS]
double eff_ [NUM_JOINTS]
hardware_interface::JointStateInterface jnt_state_interface_
hardware_interface::VelocityJointInterface jnt_vel_interface_
ros::NodeHandle nh_
double pos_ [NUM_JOINTS]
bool running_
ros::ServiceServer start_srv_
ros::ServiceServer stop_srv_
double vel_ [NUM_JOINTS]

Detailed Description

template<unsigned int NUM_JOINTS = 2>
class Diffbot< NUM_JOINTS >

Definition at line 49 of file diffbot.h.


Constructor & Destructor Documentation

template<unsigned int NUM_JOINTS = 2>
Diffbot< NUM_JOINTS >::Diffbot ( ) [inline]

Definition at line 52 of file diffbot.h.


Member Function Documentation

template<unsigned int NUM_JOINTS = 2>
ros::Duration Diffbot< NUM_JOINTS >::getPeriod ( ) const [inline]

Definition at line 81 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
ros::Time Diffbot< NUM_JOINTS >::getTime ( ) const [inline]

Definition at line 80 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
void Diffbot< NUM_JOINTS >::read ( ) [inline]

Definition at line 83 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
bool Diffbot< NUM_JOINTS >::start_callback ( std_srvs::Empty::Request &  ,
std_srvs::Empty::Response &   
) [inline]

Definition at line 115 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
bool Diffbot< NUM_JOINTS >::stop_callback ( std_srvs::Empty::Request &  ,
std_srvs::Empty::Response &   
) [inline]

Definition at line 121 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
void Diffbot< NUM_JOINTS >::write ( ) [inline]

Definition at line 95 of file diffbot.h.


Member Data Documentation

template<unsigned int NUM_JOINTS = 2>
double Diffbot< NUM_JOINTS >::cmd_[NUM_JOINTS] [private]

Definition at line 130 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
double Diffbot< NUM_JOINTS >::eff_[NUM_JOINTS] [private]

Definition at line 133 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
hardware_interface::JointStateInterface Diffbot< NUM_JOINTS >::jnt_state_interface_ [private]

Definition at line 128 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
hardware_interface::VelocityJointInterface Diffbot< NUM_JOINTS >::jnt_vel_interface_ [private]

Definition at line 129 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
ros::NodeHandle Diffbot< NUM_JOINTS >::nh_ [private]

Definition at line 136 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
double Diffbot< NUM_JOINTS >::pos_[NUM_JOINTS] [private]

Definition at line 131 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
bool Diffbot< NUM_JOINTS >::running_ [private]

Definition at line 134 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
ros::ServiceServer Diffbot< NUM_JOINTS >::start_srv_ [private]

Definition at line 137 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
ros::ServiceServer Diffbot< NUM_JOINTS >::stop_srv_ [private]

Definition at line 138 of file diffbot.h.

template<unsigned int NUM_JOINTS = 2>
double Diffbot< NUM_JOINTS >::vel_[NUM_JOINTS] [private]

Definition at line 132 of file diffbot.h.


The documentation for this class was generated from the following file:


diff_drive_controller
Author(s): Bence Magyar
autogenerated on Sat Aug 13 2016 04:20:35