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 dd2f104 commit 3d6dcd8
Show file tree
Hide file tree
Showing 7 changed files with 17 additions and 17 deletions.
4 changes: 2 additions & 2 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -7,7 +7,7 @@ find_package(catkin REQUIRED COMPONENTS
cmake_modules
cv_bridge
geometry_msgs
elikos_ros
elikos_main
elikos_detection
nav_msgs
image_transport
Expand All @@ -32,7 +32,7 @@ catkin_package(
CATKIN_DEPENDS
image_transport
cv_bridge
elikos_ros
elikos_main
elikos_detection
geometry_msgs
nav_msgs
Expand Down
4 changes: 2 additions & 2 deletions package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -13,7 +13,7 @@
<build_depend>cmake_modules</build_depend>
<build_depend>cv_bridge</build_depend>
<build_depend>geometry_msgs</build_depend>
<build_depend>elikos_ros</build_depend>
<build_depend>elikos_main</build_depend>
<build_depend>elikos_detection</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>image_transport</build_depend>
Expand All @@ -29,7 +29,7 @@
<run_depend>cmake_modules</run_depend>
<run_depend>cv_bridge</run_depend>
<run_depend>geometry_msgs</run_depend>
<run_depend>elikos_ros</run_depend>
<run_depend>elikos_main</run_depend>
<run_depend>elikos_detection</run_depend>
<run_depend>nav_msgs</run_depend>
<run_depend>image_transport</run_depend>
Expand Down
8 changes: 4 additions & 4 deletions src/feature_tracking/drone_pose_estimation.py
Original file line number Diff line number Diff line change
Expand Up @@ -7,7 +7,7 @@
import tf
import message_filters

import elikos_ros.msg as elikos_ros
import elikos_main.msg as elikos_main

import point_matching as matching
import message_interface as msgs
Expand Down Expand Up @@ -35,7 +35,7 @@ def process_points(image_unperspectived_points, estimated_3d_points):


def message_callback(localization_points, inverse_transform):
# type: (elikos_ros.IntersectionArray, elikos_ros.StampedMatrix3)->None
# type: (elikos_main.IntersectionArray, elikos_main.StampedMatrix3)->None
points_image, points_arena = msgs.deserialize_intersections(localization_points)
print points_image
print points_arena
Expand All @@ -48,8 +48,8 @@ def message_callback(localization_points, inverse_transform):
if __name__ == '__main__':
rospy.init_node("elikos_vision_estimator")

points_sub = message_filters.Subscriber("points_in", elikos_ros.IntersectionArray)
inverse_transform_sub = message_filters.Subscriber("inverse_transform", elikos_ros.StampedMatrix3)
points_sub = message_filters.Subscriber("points_in", elikos_main.IntersectionArray)
inverse_transform_sub = message_filters.Subscriber("inverse_transform", elikos_main.StampedMatrix3)

synchroniser = message_filters.TimeSynchronizer([points_sub, inverse_transform_sub], 50)

Expand Down
4 changes: 2 additions & 2 deletions src/feature_tracking/fallback.py
Original file line number Diff line number Diff line change
Expand Up @@ -21,7 +21,7 @@
from geometry_msgs.msg import PoseArray
from sensor_msgs.msg import CameraInfo
from std_msgs.msg import Header
import elikos_ros.msg as elikos_ros
import elikos_main.msg as elikos_main

import message_interface as msgs
import point_manipulation as pt_manip
Expand Down Expand Up @@ -110,7 +110,7 @@ def __init__(self):

points_filter_subscriber = message_filters.Subscriber(
points_subscriber_name,
elikos_ros.IntersectionArray,
elikos_main.IntersectionArray,
queue_size=1
)
camera_info_filter_subscriber = message_filters.Subscriber(
Expand Down
4 changes: 2 additions & 2 deletions src/feature_tracking/message_interface.py
Original file line number Diff line number Diff line change
Expand Up @@ -4,11 +4,11 @@
Interface to serialize en deserealize ros messages.
"""
import numpy as np
import elikos_ros.msg as elikos_ros
import elikos_main.msg as elikos_main


def deserialize_intersections(localization_points):
# type: (elikos_ros.IntersectionArray)->(np.ndarray,np.ndarray)
# type: (elikos_main.IntersectionArray)->(np.ndarray,np.ndarray)
u"""
Prens un message de localisation et retourne un message de points.
:param localization_points: le message
Expand Down
6 changes: 3 additions & 3 deletions src/localization/arena-detection/IntersectionTransform.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -21,7 +21,7 @@ IntersectionTransform::IntersectionTransform(const CameraInfo& cameraInfo, const

pivot_ = tf::Vector3(0.0, 0.0, 0.14);

intersectionPub_ = nh.advertise<elikos_ros::IntersectionArray>(cameraInfo_.name + "/intersections", 1);
intersectionPub_ = nh.advertise<elikos_main::IntersectionArray>(cameraInfo_.name + "/intersections", 1);
debugPub_ = nh.advertise<visualization_msgs::MarkerArray>(cameraInfo_.name + "/intersection_debug", 1);

marker_.header.frame_id = "elikos_fcu";
Expand Down Expand Up @@ -158,15 +158,15 @@ void IntersectionTransform::publishTransformedIntersections(const std::vector<cv
{
if (imageIntersections.size() == poseArray.poses.size())
{
elikos_ros::IntersectionArray msg;
elikos_main::IntersectionArray msg;
msg.header.stamp = state_.getTimeStamp();
msg.header.frame_id = "elikos_fcu";

visualization_msgs::MarkerArray array;

for (int i = 0; i < imageIntersections.size(); ++i)
{
elikos_ros::Intersection intersection;
elikos_main::Intersection intersection;
intersection.imagePosition.x = imageIntersections[i].x;
intersection.imagePosition.y = imageIntersections[i].y;

Expand Down
4 changes: 2 additions & 2 deletions src/localization/arena-detection/IntersectionTransform.h
Original file line number Diff line number Diff line change
Expand Up @@ -16,8 +16,8 @@

#include "geometry_msgs/PoseArray.h"

#include <elikos_ros/Intersection.h>
#include <elikos_ros/IntersectionArray.h>
#include <elikos_main/Intersection.h>
#include <elikos_main/IntersectionArray.h>

#include <visualization_msgs/MarkerArray.h>
#include <visualization_msgs/Marker.h>
Expand Down

0 comments on commit 3d6dcd8

Please sign in to comment.