publish_control_board_rev3.h
Go to the documentation of this file.
1 /*
2 * Unpublished Copyright (c) 2009-2018 AutonomouStuff, LLC, All Rights Reserved.
3 *
4 * This file is part of the PACMod ROS 1.0 driver which is released under the MIT license.
5 * See file LICENSE included with this software or go to https://opensource.org/licenses/MIT for full license details.
6 */
7 
8 #ifndef PUBLISH_CONTROL_BOARD_REV3_H
9 #define PUBLISH_CONTROL_BOARD_REV3_H
10 
11 #include "globals.h"
12 #include "publish_control.h"
13 
14 #include <pacmod_msgs/SteerSystemCmd.h>
15 #include <pacmod_msgs/SystemCmdBool.h>
16 #include <pacmod_msgs/SystemCmdFloat.h>
17 #include <pacmod_msgs/SystemCmdInt.h>
18 #include <pacmod_msgs/SystemRptInt.h>
19 
20 namespace AS
21 {
22 namespace Joystick
23 {
24 
26  public PublishControl
27 {
28  public:
30  static void callback_shift_rpt(const pacmod_msgs::SystemRptInt::ConstPtr& msg);
31  static void callback_turn_rpt(const pacmod_msgs::SystemRptInt::ConstPtr& msg);
32 
33  // Variables
34  static int last_shift_cmd;
35  static int last_turn_cmd;
36  static float last_brake_cmd;
37 
38  private:
39  // private functions
40  void publish_steering_message(const sensor_msgs::Joy::ConstPtr& msg);
41  void publish_turn_signal_message(const sensor_msgs::Joy::ConstPtr& msg);
42  void publish_shifting_message(const sensor_msgs::Joy::ConstPtr& msg);
43  void publish_accelerator_message(const sensor_msgs::Joy::ConstPtr& msg);
44  void publish_brake_message(const sensor_msgs::Joy::ConstPtr& msg);
45  void publish_lights_horn_wipers_message(const sensor_msgs::Joy::ConstPtr& msg);
46 
47  // ROS Subscribers
50 };
51 
52 }
53 }
54 
55 #endif
msg
void publish_lights_horn_wipers_message(const sensor_msgs::Joy::ConstPtr &msg)
void publish_accelerator_message(const sensor_msgs::Joy::ConstPtr &msg)
Definition: globals.h:20
void publish_turn_signal_message(const sensor_msgs::Joy::ConstPtr &msg)
void publish_steering_message(const sensor_msgs::Joy::ConstPtr &msg)
static void callback_turn_rpt(const pacmod_msgs::SystemRptInt::ConstPtr &msg)
static void callback_shift_rpt(const pacmod_msgs::SystemRptInt::ConstPtr &msg)
void publish_shifting_message(const sensor_msgs::Joy::ConstPtr &msg)
void publish_brake_message(const sensor_msgs::Joy::ConstPtr &msg)


pacmod_game_control
Author(s): Joe Driscoll
autogenerated on Thu Jun 6 2019 19:19:40