diff --git a/CMakeLists.txt b/CMakeLists.txt index 6687faf..d8e159d 100644 --- a/CMakeLists.txt +++ b/CMakeLists.txt @@ -1,5 +1,5 @@ cmake_minimum_required(VERSION 2.8.3) -project(echoslam_ROS) +project(echoslam_ros) ## Compile as C++11, supported in ROS Kinetic and newer # add_compile_options(-std=c++11) diff --git a/launch/team.launch b/launch/team.launch index 7401393..d7753c5 100644 --- a/launch/team.launch +++ b/launch/team.launch @@ -7,14 +7,14 @@ - + - \ No newline at end of file + diff --git a/package.xml b/package.xml index 55dd08f..0899e5d 100644 --- a/package.xml +++ b/package.xml @@ -1,6 +1,6 @@ - echoslam_ROS + echoslam_ros 0.0.0 The echoslam package diff --git a/scripts/bot.py b/scripts/bot.py index 7ddfa1e..c3ff6db 100755 --- a/scripts/bot.py +++ b/scripts/bot.py @@ -8,8 +8,8 @@ """ -from echoslam_ROS.msg import Bot #28/08/2020 : Aditya changed echoslam to echoslam_ROS in this line. -from echoslam_ROS.srv import * +from echoslam_ros.msg import Bot #28/08/2020 : Aditya changed echoslam to echoslam_ROS in this line. +from echoslam_ros.srv import * from std_msgs.msg import Int32 import sys import rospkg diff --git a/scripts/bot_server_node.py b/scripts/bot_server_node.py index 65f691e..2d25f85 100755 --- a/scripts/bot_server_node.py +++ b/scripts/bot_server_node.py @@ -6,11 +6,11 @@ import rospkg import rospy -from echoslam_ROS.srv import BotService, BotServiceResponse +from echoslam_ros.srv import BotService, BotServiceResponse rospack = rospkg.RosPack() -path = rospack.get_path("echoslam_ROS") +path = rospack.get_path("echoslam_ros") sys.path.append(path) from src.robot import Robot diff --git a/scripts/plotter_node.py b/scripts/plotter_node.py index 6c279f5..764138a 100755 --- a/scripts/plotter_node.py +++ b/scripts/plotter_node.py @@ -3,7 +3,7 @@ import rospy import matplotlib.pyplot as plt import matplotlib.animation as animation -from echoslam_ROS.msg import Bot +from echoslam_ros.msg import Bot rospy.init_node("plotter_node") bots = rospy.get_param("/size") @@ -31,4 +31,4 @@ def callback(msg): plt.plot(bot_x, bot_y, 'ro') plt.pause(0.1) plt.clf() - \ No newline at end of file + diff --git a/src/robot.py b/src/robot.py index 5f051bd..27e19a7 100644 --- a/src/robot.py +++ b/src/robot.py @@ -1,4 +1,4 @@ -from echoslam_ROS.msg import Bot +from echoslam_ros.msg import Bot # from echoslam.msg import Bot import rospkg import rospy