#include <p2os.h>
Definition at line 86 of file p2os.h.
P2OSNode::P2OSNode |
( |
ros::NodeHandle |
n | ) |
|
P2OS robot driver node.
This class contains, essentially, the main means of communication between the robot and ROS.
Constructor for P2OS node.
This brings up the P2OS system for ROS operation.
Definition at line 32 of file p2os.cc.
void P2OSNode::check_and_set_gripper_state |
( |
| ) |
|
void P2OSNode::check_and_set_motor_state |
( |
| ) |
|
void P2OSNode::check_and_set_vel |
( |
| ) |
|
void P2OSNode::check_stall |
( |
diagnostic_updater::DiagnosticStatusWrapper & |
stat | ) |
|
void P2OSNode::check_voltage |
( |
diagnostic_updater::DiagnosticStatusWrapper & |
stat | ) |
|
void P2OSNode::cmdmotor_state |
( |
const p2os_msgs::MotorStateConstPtr & |
msg | ) |
|
void P2OSNode::cmdvel_cb |
( |
const geometry_msgs::TwistConstPtr & |
msg | ) |
|
unsigned char P2OSNode::DegreesToTicks |
( |
int |
joint, |
|
|
double |
degrees |
|
) |
| |
|
inline |
convert degrees to ticks
Definition at line 893 of file p2os.cc.
double P2OSNode::get_pulse |
( |
| ) |
|
|
inline |
void P2OSNode::gripperCallback |
( |
const p2os_msgs::GripperStateConstPtr & |
msg | ) |
|
unsigned char P2OSNode::RadiansToTicks |
( |
int |
joint, |
|
|
double |
rads |
|
) |
| |
|
inline |
Convert radians to ticks.
Definition at line 922 of file p2os.cc.
double P2OSNode::RadsPerSectoSecsPerTick |
( |
int |
joint, |
|
|
double |
speed |
|
) |
| |
|
inline |
Convert radians per second to radians per encoder tick.
Definition at line 929 of file p2os.cc.
void P2OSNode::ResetRawPositions |
( |
| ) |
|
double P2OSNode::SecsPerTicktoRadsPerSec |
( |
int |
joint, |
|
|
double |
secs |
|
) |
| |
|
inline |
Convert Seconds per encoder tick to radians per second.
Definition at line 944 of file p2os.cc.
void P2OSNode::SendPulse |
( |
void |
| ) |
|
int P2OSNode::SendReceive |
( |
P2OSPacket * |
pkt, |
|
|
bool |
publish_data = true |
|
) |
| |
Setup the robot for use. Communicates with the robot directly.
Definition at line 273 of file p2os.cc.
int P2OSNode::Shutdown |
( |
| ) |
|
Prepare for shutdown.
Definition at line 657 of file p2os.cc.
void P2OSNode::StandardSIPPutData |
( |
ros::Time |
ts | ) |
|
double P2OSNode::TicksToDegrees |
( |
int |
joint, |
|
|
unsigned char |
ticks |
|
) |
| |
|
inline |
Convert ticks to degrees.
Definition at line 876 of file p2os.cc.
double P2OSNode::TicksToRadians |
( |
int |
joint, |
|
|
unsigned char |
ticks |
|
) |
| |
|
inline |
Convert ticks to radians.
Definition at line 915 of file p2os.cc.
void P2OSNode::ToggleMotorPower |
( |
unsigned char |
val | ) |
|
Toggle motors on/off.
Turn on/off the robots in accordance to val.
- Parameters
-
val | Determines what state the motor should be. 1 = enabled, 0 = disabled. |
Definition at line 856 of file p2os.cc.
void P2OSNode::ToggleSonarPower |
( |
unsigned char |
val | ) |
|
void P2OSNode::updateDiagnostics |
( |
| ) |
|
ros::Publisher P2OSNode::aio_pub_ |
|
protected |
diagnostic_updater::DiagnosedPublisher<p2os_msgs::BatteryState> P2OSNode::batt_pub_ |
|
protected |
Stall I hit a wall?
Definition at line 165 of file p2os.h.
p2os_msgs::MotorState P2OSNode::cmdmotor_state_ |
Motor state publisher.
Definition at line 198 of file p2os.h.
ros::Subscriber P2OSNode::cmdmstate_sub_ |
|
protected |
geometry_msgs::Twist P2OSNode::cmdvel_ |
Command Velocity subscriber.
Definition at line 196 of file p2os.h.
ros::Subscriber P2OSNode::cmdvel_sub_ |
|
protected |
double P2OSNode::desired_freq |
|
protected |
diagnostic_updater::Updater P2OSNode::diagnostic_ |
|
protected |
ros::Publisher P2OSNode::dio_pub_ |
|
protected |
int P2OSNode::direct_wheel_vel_control |
|
protected |
Control wheel velocities individually?
Definition at line 169 of file p2os.h.
ros::Publisher P2OSNode::grip_state_pub_ |
|
protected |
bool P2OSNode::gripper_dirty_ |
|
protected |
p2os_msgs::GripperState P2OSNode::gripper_state_ |
Gripper state publisher.
Definition at line 200 of file p2os.h.
ros::Subscriber P2OSNode::gripper_sub_ |
|
protected |
Use Joystick?
Definition at line 167 of file p2os.h.
double P2OSNode::lastPulseTime |
|
protected |
Last time the node received or sent a pulse.
Definition at line 188 of file p2os.h.
bool P2OSNode::motor_dirty |
|
protected |
short P2OSNode::motor_max_rot_accel |
|
protected |
Maximum rotational acceleration in radians per second per second.
Definition at line 181 of file p2os.h.
short P2OSNode::motor_max_rot_decel |
|
protected |
Minimum rotational acceleration in Meters per second per second.
Definition at line 183 of file p2os.h.
int P2OSNode::motor_max_speed |
|
protected |
Maximum motor speed in Meters per second.
Definition at line 173 of file p2os.h.
short P2OSNode::motor_max_trans_accel |
|
protected |
Maximum translational acceleration in Meters per second per second.
Definition at line 177 of file p2os.h.
short P2OSNode::motor_max_trans_decel |
|
protected |
Minimum translational acceleration in Meters per second per second.
Definition at line 179 of file p2os.h.
int P2OSNode::motor_max_turnspeed |
|
protected |
Maximum turn speed in radians per second.
Definition at line 175 of file p2os.h.
ros::Publisher P2OSNode::mstate_pub_ |
|
protected |
ros::NodeHandle P2OSNode::n |
|
protected |
Node Handler used for publication of data.
Definition at line 137 of file p2os.h.
ros::NodeHandle P2OSNode::nh_private |
|
protected |
Node Handler used for private data publication.
Definition at line 139 of file p2os.h.
tf::TransformBroadcaster P2OSNode::odom_broadcaster |
|
protected |
sensor data container
Definition at line 202 of file p2os.h.
ros::Publisher P2OSNode::pose_pub_ |
|
protected |
std::string P2OSNode::psos_serial_port |
|
protected |
std::string P2OSNode::psos_tcp_host |
|
protected |
int P2OSNode::psos_tcp_port |
|
protected |
bool P2OSNode::psos_use_tcp |
|
protected |
ros::Subscriber P2OSNode::ptz_cmd_sub_ |
|
protected |
ros::Publisher P2OSNode::ptz_state_pub_ |
|
protected |
Pulse time.
Definition at line 185 of file p2os.h.
int P2OSNode::radio_modemp |
|
protected |
ros::Publisher P2OSNode::sonar_pub_ |
|
protected |
bool P2OSNode::use_sonar_ |
|
protected |
Use the sonar array?
Definition at line 190 of file p2os.h.
ros::Time P2OSNode::veltime |
|
protected |
The documentation for this class was generated from the following files: