publish_control_board_rev2.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_REV2_H
9 #define PUBLISH_CONTROL_BOARD_REV2_H
10 
11 #include "globals.h"
12 #include "publish_control.h"
13 
14 #include <pacmod_msgs/PositionWithSpeed.h>
15 #include <pacmod_msgs/PacmodCmd.h>
16 
17 namespace AS
18 {
19 namespace Joystick
20 {
21 
22 // Publish control class, child class from publish control
24  public PublishControl
25 {
26  public:
28 
29  private:
30  // private functions
31  void publish_steering_message(const sensor_msgs::Joy::ConstPtr& msg);
32  void publish_turn_signal_message(const sensor_msgs::Joy::ConstPtr& msg);
33  void publish_shifting_message(const sensor_msgs::Joy::ConstPtr& msg);
34  void publish_accelerator_message(const sensor_msgs::Joy::ConstPtr& msg);
35  void publish_brake_message(const sensor_msgs::Joy::ConstPtr& msg);
36  void publish_lights_horn_wipers_message(const sensor_msgs::Joy::ConstPtr& msg);
37 };
38 
39 }
40 }
41 
42 #endif
msg
void publish_shifting_message(const sensor_msgs::Joy::ConstPtr &msg)
Definition: globals.h:20
void publish_steering_message(const sensor_msgs::Joy::ConstPtr &msg)
void publish_accelerator_message(const sensor_msgs::Joy::ConstPtr &msg)
void publish_lights_horn_wipers_message(const sensor_msgs::Joy::ConstPtr &msg)
void publish_brake_message(const sensor_msgs::Joy::ConstPtr &msg)
void publish_turn_signal_message(const sensor_msgs::Joy::ConstPtr &msg)


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