Skip to content

Commit

Permalink
Clean up and renaming of elikos_ros package to elikos_main.
Browse files Browse the repository at this point in the history
  • Loading branch information
eterriault committed Aug 30, 2017
1 parent b375f3c commit ede090f
Show file tree
Hide file tree
Showing 10 changed files with 25 additions and 25 deletions.
4 changes: 2 additions & 2 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -5,7 +5,7 @@ set(CMAKE_CXX_FLAGS "-std=c++11 -I/usr/include/eigen3 ${CMAKE_CXX_FLAGS}")
find_package(catkin REQUIRED COMPONENTS
roscpp
cv_bridge
elikos_ros
elikos_main
image_transport
geometry_msgs
sensor_msgs
Expand All @@ -25,7 +25,7 @@ find_package(OpenCV 2 REQUIRED)
catkin_package(
INCLUDE_DIRS src/elikos_transformation_utils src/elikos_context_utils
LIBRARIES elikos_transformation_utils elikos_context_utils
CATKIN_DEPENDS roscpp cv_bridge elikos_ros image_transport sensor_msgs geometry_msgs std_msgs tf
CATKIN_DEPENDS roscpp cv_bridge elikos_main image_transport sensor_msgs geometry_msgs std_msgs tf
# DEPENDS system_lib
)

Expand Down
2 changes: 1 addition & 1 deletion README.md
Original file line number Diff line number Diff line change
Expand Up @@ -55,7 +55,7 @@

## Output topics
* `elikos_target_robot_array`
* type : `elikos_ros::TargetRobotArray`
* type : `elikos_main::TargetRobotArray`
* desc : résultats du package.
* `(topic spécifié dans le fichier de configuration)/debug`
* type : image couleur avec annotations
Expand Down
2 changes: 1 addition & 1 deletion launch/handquad_test.launch
Original file line number Diff line number Diff line change
Expand Up @@ -6,7 +6,7 @@
<arg name="cfg" value="elikos_hand_quad"/>
</include>

<include file="$(find elikos_ros)/launch/px4.launch" />
<include file="$(find elikos_main)/launch/px4.launch" />

<node pkg="tf" type="static_transform_publisher" name="camera_broadcaster" args="0.1 0.0 0.0 -0.5 0.5 -0.5 0.5 elikos_fcu elikos_hand_quad 100" />
<node pkg="tf" type="static_transform_publisher" name="arena_origin_broadcaster" args="0.0 0.0 0.0 0.0 0.0 0.0 1.0 elikos_local_origin elikos_arena_origin 100" />
Expand Down
4 changes: 2 additions & 2 deletions package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -42,7 +42,7 @@
<buildtool_depend>catkin</buildtool_depend>
<build_depend>roscpp</build_depend>
<build_depend>cv_bridge</build_depend>
<build_depend>elikos_ros</build_depend>
<build_depend>elikos_main</build_depend>
<build_depend>image_transport</build_depend>
<build_depend>sensor_msgs</build_depend>
<build_depend>std_msgs</build_depend>
Expand All @@ -53,7 +53,7 @@

<run_depend>roscpp</run_depend>
<run_depend>cv_bridge</run_depend>
<run_depend>elikos_ros</run_depend>
<run_depend>elikos_main</run_depend>
<run_depend>image_transport</run_depend>
<run_depend>sensor_msgs</run_depend>
<run_depend>std_msgs</run_depend>
Expand Down
6 changes: 3 additions & 3 deletions src/elikos_detection/MessageHandler.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -38,7 +38,7 @@ MessageHandler::MessageHandler(string calibrationFilename)
subRC_ = nh_.subscribe(RCinputTopic, 100, &MessageHandler::dispatchCommand, this);
std::string cam_name = ros::this_node::getName();
cam_name = cam_name.substr(0, cam_name.size()-std::string("_detection").size());
pub_ = nh_.advertise<elikos_ros::RobotRawArray>("/"+cam_name+"/elikos_robot_raw_array", 1);
pub_ = nh_.advertise<elikos_main::RobotRawArray>("/"+cam_name+"/elikos_robot_raw_array", 1);
pubCommandOutput_ = nh_.advertise<std_msgs::String>(RCCommandOutputTopic, 100);

pubImages_ = it_.advertise(RCdebugTopic, 1); // debug only
Expand Down Expand Up @@ -118,8 +118,8 @@ void MessageHandler::dispatchMessage(const sensor_msgs::ImageConstPtr& input) {
}

// publishing data
elikos_ros::RobotRawArray output;
elikos_ros::RobotRaw data;
elikos_main::RobotRawArray output;
elikos_main::RobotRaw data;

for (auto robot : robotsArray) {
data.id = robot.getID();
Expand Down
4 changes: 2 additions & 2 deletions src/elikos_detection/MessageHandler.h
Original file line number Diff line number Diff line change
Expand Up @@ -3,8 +3,8 @@

#include "TargetDetection/TargetDetection.h"
#include <cv_bridge/cv_bridge.h>
#include <elikos_ros/RobotRaw.h>
#include <elikos_ros/RobotRawArray.h>
#include <elikos_main/RobotRaw.h>
#include <elikos_main/RobotRawArray.h>
#include <image_transport/image_transport.h>
#include <ros/ros.h>
#include <sensor_msgs/image_encodings.h>
Expand Down
2 changes: 1 addition & 1 deletion src/elikos_transformation/MessageHandler.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -15,7 +15,7 @@ MessageHandler::~MessageHandler()
}


void MessageHandler::dispatchMessageRobotRaw(const elikos_ros::RobotRawArray::ConstPtr& input)
void MessageHandler::dispatchMessageRobotRaw(const elikos_main::RobotRawArray::ConstPtr& input)
{
//Le vecteur results est pour l'affichage dans rviz.
geometry_msgs::PoseArray results = transformationUnit_.computeTransformForRobots(*input);
Expand Down
8 changes: 4 additions & 4 deletions src/elikos_transformation/MessageHandler.h
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
#define MESSAGE_HANDLER

#include <ros/ros.h>
#include <elikos_ros/RobotRaw.h>
#include <elikos_ros/RobotRawArray.h>
#include <elikos_main/RobotRaw.h>
#include <elikos_main/RobotRawArray.h>
#include <geometry_msgs/PoseStamped.h>
#include <cv_bridge/cv_bridge.h>

Expand All @@ -14,13 +14,13 @@ class MessageHandler
public:
MessageHandler();
~MessageHandler();
void dispatchMessageRobotRaw(const elikos_ros::RobotRawArray::ConstPtr &input);
void dispatchMessageRobotRaw(const elikos_main::RobotRawArray::ConstPtr &input);

private:
ros::NodeHandle nh_;
ros::Subscriber sub_;
ros::Publisher pubTest_;
elikos_ros::RobotRawArray newArray_;
elikos_main::RobotRawArray newArray_;
TransformationUnit transformationUnit_;
};

Expand Down
8 changes: 4 additions & 4 deletions src/elikos_transformation/TransformationUnit.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@

TransformationUnit::TransformationUnit()
{
pub_ = nh_.advertise<elikos_ros::TargetRobotArray>("elikos_target_robot_array",1);
pub_ = nh_.advertise<elikos_main::TargetRobotArray>("elikos_target_robot_array",1);

//Parameters
if (!nh_.getParam("/"+ros::this_node::getName()+"/frame", cameraFrameID_))
Expand Down Expand Up @@ -33,8 +33,8 @@ TransformationUnit::TransformationUnit()
}
}

geometry_msgs::PoseArray TransformationUnit::computeTransformForRobots(elikos_ros::RobotRawArray robotArray){
elikos_ros::TargetRobotArray targetArray;
geometry_msgs::PoseArray TransformationUnit::computeTransformForRobots(elikos_main::RobotRawArray robotArray){
elikos_main::TargetRobotArray targetArray;

//results for simulation in rviz
geometry_msgs::PoseArray results;
Expand Down Expand Up @@ -90,7 +90,7 @@ geometry_msgs::PoseArray TransformationUnit::computeTransformForRobots(elikos_ro
results.poses.push_back(robotPoseOrigin.pose);
//results.poses.push_back(robotPoseFcu.pose);

elikos_ros::TargetRobot target;
elikos_main::TargetRobot target;
target.id = robot.id;
target.color = robot.color;
target.poseOrigin = robotPoseOrigin;
Expand Down
10 changes: 5 additions & 5 deletions src/elikos_transformation/TransformationUnit.h
Original file line number Diff line number Diff line change
Expand Up @@ -10,10 +10,10 @@
#include <tf/transform_listener.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_datatypes.h>
#include <elikos_ros/RobotRawArray.h>
#include <elikos_ros/RobotRaw.h>
#include <elikos_ros/TargetRobotArray.h>
#include <elikos_ros/TargetRobot.h>
#include <elikos_main/RobotRawArray.h>
#include <elikos_main/RobotRaw.h>
#include <elikos_main/TargetRobotArray.h>
#include <elikos_main/TargetRobot.h>
#include <string>
#include <sstream>
#include <geometry_msgs/Pose.h>
Expand All @@ -25,7 +25,7 @@ class TransformationUnit
public:
TransformationUnit();
//Turret: frame coordinate referencing the camera to robot vector.
geometry_msgs::PoseArray computeTransformForRobots(elikos_ros::RobotRawArray);
geometry_msgs::PoseArray computeTransformForRobots(elikos_main::RobotRawArray);

private:
tf::TransformBroadcaster tf_broadcaster_;
Expand Down

0 comments on commit ede090f

Please sign in to comment.